7.7. Scene Segmentation Example¶

#!/usr/bin/env python
# 
# VIPER: Vision Inference Processing (Edge) Endogenous Robot
# Andrew D'Amico
# MSDS 462 Computer Vision
# Northwestern University
# Copyright (c) 2021, Andrew D'Amico. All rights reserved.
# Licenced under BSD Licence.

###################################|####################################
############################ M O D U L E S #############################
############################# ROS MODULES ##############################
import rospy
from viper_toolkit import NameManager, ProcessTimer
from viper_toolkit import Parameter, ParameterManager

############################# STD MODULES ##############################
import time
import numpy as np
import cv2
from cv_bridge import CvBridge, CvBridgeError
from viper_toolkit import ProcessTimer, NameManager

######################### IMAGE SERVER MODULES #########################
#from model_server.srv import ImageRequest, ImageRequestResponse
from sensor_msgs.msg import Image
from sensor_msgs.msg import CameraInfo

######################### MODEL SERVER MODULES #########################
from model_server.msg import InferenceResults
from array import array

##### Pose Detection
#from pose_detector import PoseDetectionModel
from pose_detection_module import draw_poses

##### Scene Segmentation
#from scene_segmentation import SceneSegmentationModel
from scene_segmentation_module import segmentation_map_to_image

########################### OpenVino MODULES ###########################
#from openvino.inference_engine import IENetwork, IECore

######################### AUGMENTED VR MODULES #########################
rospy.init_node('SEG_Debugger', log_level = rospy.DEBUG)
Unable to register with master node [http://localhost:11311]: master may not be running yet. Will keep trying.
/opt/ros/noetic/lib/python3/dist-packages/rospy/impl/registration.py:379: DeprecationWarning: The 'warn' method is deprecated, use 'warning' instead
  self.logger.warn("cannot unregister with master due to network issues")
def setup_parameters():
        # Adds all of our parameters to an updatable list. If ROS cannot
        # find the parameter, it will use the default provided.
        
    parameters = ParameterManager()
        
    parameters.add(Parameter("width", "/inland_ir_cam/width", default = 800, dynamic = True))
    parameters.add(Parameter("height", "/inland_ir_cam/height", 600, True))
    parameters.add(Parameter("updates", f"{self.name.name}/dynamic", True, True))
    parameters.add(Parameter("image_output", f"{self.name.name}/image_output", True, True))
    parameters.add(Parameter("alpha", rospy.search_param('alpha'), 0.3, True))
    parameters.add(Parameter("threshold", rospy.search_param('threshold'), 0.1, True))
    parameters.add(Parameter("segmentationmodel", f"{self.name.name}/segmentation", True, True))
    parameters.add(Parameter("posedetectionmodel", f"{self.name.name}/posedetection", True, True))
    parameters.add(Parameter("rate", f"{self.name.name}/rate", 25, True))
[ERROR] [1638407060.829556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407061.094795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407061.413979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407061.687604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407061.979184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407062.191197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407062.540079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407062.775775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407063.084337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407063.376934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407063.622195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407063.938402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407064.150042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407064.358502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407064.600666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407064.902175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407065.209490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407065.487052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407065.761526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407066.209073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407066.375935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407066.576612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407066.777743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407067.025465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407067.172831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407067.414665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407067.582949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407067.776079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407067.955457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407068.156357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407068.295231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407068.483020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407068.657656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407068.865620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407069.025515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407069.202541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407069.362244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407069.543008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407069.692770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407069.916525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407070.125963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407070.344235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407070.576659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407070.786417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407070.970284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407071.190447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407071.334460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407071.547477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407071.719990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407071.965277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407072.117757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407072.297235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407072.464240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407072.651429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407072.797753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407073.014689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407073.185862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407073.390259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407073.533249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407073.765495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407073.911312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407074.085687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407074.231042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407074.430231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407074.588475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407074.778963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407074.935066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407075.108522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407075.280222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407075.465914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407075.644333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407075.814891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407075.973740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407076.192132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407076.335632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407076.527035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407076.717948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407076.904368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407077.073755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407077.259961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407077.411491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407077.628848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407077.772587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407077.992137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407078.149790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407078.343696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407078.531085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407078.838814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407079.001288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407079.227690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407079.358160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407079.573929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407079.744279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407079.956120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407080.105160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407080.292161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407080.455611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407080.650374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407080.805818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407080.995605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407081.330347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407081.491348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407081.661166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407081.870160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407082.039826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407082.278502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407082.428572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407082.653039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407082.798532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407083.011670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407083.163422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407083.342819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407083.520825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407083.705312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407083.841369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407084.077562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407084.224560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407084.396266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407084.556166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407084.821234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407084.961796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407085.124972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407085.373577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407085.568696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407085.772536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407085.924636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407086.125548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407086.272663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407086.463587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407086.645937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407086.880659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407087.039516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407087.226783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407087.380783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407087.598116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407087.750147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407087.965940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407088.140022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407088.330371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407088.474741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407088.744107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407088.911926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407089.084762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407089.254248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407089.456095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407089.590961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407089.778042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407089.964981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407090.187311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407090.338113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407090.532708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407090.672385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407090.855088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407091.046378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407091.303376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407091.447613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407091.641737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407091.782666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407091.984719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407092.163706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407092.375618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407092.544689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407092.748086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407092.911574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407093.094534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407093.257865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407093.488267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407093.646422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407093.869173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407094.029306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407094.243546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407094.422042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407094.663518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407094.794234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407094.975912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407095.149779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407095.374797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407095.511785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407095.718200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407095.897331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407096.185531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407096.340061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407096.581659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407096.707660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407096.896804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407097.044095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407097.282921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407097.446171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407097.654568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407097.872682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407098.062679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407098.304953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407098.461121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407098.665160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407098.837898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407099.017059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407099.178236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407099.393804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407099.567533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407099.805793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407099.970938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407100.184610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407100.343499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407100.559125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407100.739414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407100.939131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407101.085747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407101.278466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407101.473029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407101.591119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407101.856061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407102.042994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407102.255271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407102.427363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407102.706929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407102.833030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407103.001897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407103.215744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407103.433498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407103.771291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407103.902264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407104.095649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407104.330892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407104.523502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407104.758652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407104.901481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407105.101338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407105.280875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407105.529899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407105.661976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407105.850923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407106.018076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407106.253791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407106.467565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407106.644431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407106.879922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407107.066747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407107.215656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407107.380658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407107.596345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407107.772595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407108.010711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407108.163074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407108.354496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407108.538301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407108.755580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407108.916565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407109.140893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407109.297144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407109.527211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407109.690667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407109.932139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407110.085838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407110.259928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407110.451038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407110.639565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407110.807030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407110.999778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407111.241469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407111.479093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407111.702886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407111.904575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407112.143747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407112.312330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407112.519477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407112.665027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407112.918185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407113.056273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407113.272217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407113.451583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407113.676728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407113.857294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407114.131024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407114.325082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407114.586196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407114.831234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407115.032168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407115.291418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407115.437532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407115.601026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407115.790173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407116.017927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407116.176849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407116.394196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407116.693808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407116.915163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407117.151225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407117.349804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407117.655140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407117.853756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407118.069599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407118.236075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407118.433037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407118.608360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407118.823637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407118.976352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407119.231644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407119.379435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407119.591665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407119.748107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407119.954765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407120.137463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407120.351911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407120.503552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407120.704104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407120.861037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407121.088557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407121.273050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407121.478427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407121.640007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407121.843358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407122.028964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407122.249851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407122.373281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407122.592981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407122.765896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407123.005145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407123.172902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407123.373050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407123.562274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407123.731415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407123.931858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407124.150629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407124.297099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407124.537796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407124.695249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407124.874620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407125.097650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407125.288036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407125.527737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407125.669130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407125.895216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407126.141883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407126.381056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407126.583011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407126.813764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407126.963250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407127.144216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407127.308559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407127.553113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407127.690215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407127.853211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407128.058165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407128.269942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407128.424856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407128.666868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407128.806599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407128.994899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407129.167677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407129.406115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407129.571755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407129.780355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407129.966069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407130.200210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407130.338843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407130.512764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407130.726665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407130.949312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407131.165711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407131.510848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407131.644518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407131.890684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407132.063789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407132.237959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407132.418681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407132.648125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407132.831029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407133.035249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407133.211478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407133.415534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407133.559453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407133.774343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407133.925817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407134.170391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407134.319060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407134.538172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407134.694705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407134.919969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407135.060392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407135.252613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407135.435212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407135.666503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407135.816247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407136.059753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407136.205803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407136.393496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407136.603652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407136.829274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407137.042446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407137.284178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407137.505641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407137.723387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407137.962296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407138.212463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407138.476193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407138.645000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407138.853986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407139.025241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407139.262255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407139.412318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407139.625063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407139.778810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407140.001082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407140.158322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407140.365830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407140.538574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407140.764933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407140.921066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407141.199374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407141.377429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407141.608773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407141.772926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407141.974638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407142.177749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407142.377946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407142.599024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407142.764194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407142.957837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407143.136459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407143.378222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407143.537515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407143.723667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407143.899759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407144.101181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407144.278200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407144.512711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407144.643348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407144.844884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407145.001121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407145.212920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407145.377885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407145.636909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407145.778311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407146.026564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407146.163215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407146.403522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407146.565162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407146.779365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407146.936558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407147.157495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407147.326421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407147.556111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407147.709023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407147.888935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407148.120477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407148.328807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407148.579000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407148.774900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407149.007478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407149.149627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407149.360428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407149.561094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407149.745220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407149.912027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407150.151593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407150.332943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407150.523918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407150.686681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407150.912411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407151.098569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407151.348886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407151.468885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407151.661843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407151.842263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407152.071576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407152.211712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407152.420126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407152.601292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407152.843158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407152.994854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407153.172379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407153.363320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407153.618423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407153.756463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407153.936355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407154.141721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407154.413309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407154.586330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407154.784760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407154.951447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407155.162996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407155.336218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407155.573430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407155.697976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407155.879174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407156.120986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407156.378956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407156.612305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407156.852211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407157.065001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407157.328771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407157.543232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407157.760545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407158.015404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407158.200261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407158.416507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407158.541087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407158.760757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407158.946666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407159.142610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407159.312351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407159.557179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407159.702382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407159.922998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407160.097212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407160.333793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407160.474555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407160.668931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407160.873313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407161.090751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407161.240675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407161.458892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407161.683578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407161.872381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407162.096545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407162.244309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407162.473879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407162.666178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407162.841611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407163.028701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407163.262209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407163.412317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407163.639536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407163.775201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407163.967148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407164.149187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407164.372904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407164.534952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407164.760185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407164.935466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407165.151369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407165.321510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407165.507044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407165.692776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407165.907007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407166.055628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407166.263634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407166.436442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407166.676534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407166.805865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407166.967934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407167.169066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407167.398495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407167.564049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407167.789226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407167.951960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407168.102092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407168.312333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407168.560376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407168.766329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407168.996221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407169.159210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407169.345529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407169.530606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407169.751820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407169.902260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407170.099173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407170.268484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407170.494037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407170.686961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407170.894541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407171.041891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407171.319041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407171.490648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407171.708384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407171.858974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407172.085308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407172.245234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407172.468369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407172.643888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407172.868876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407173.019638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407173.190050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407173.391960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407173.612504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407173.855922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407174.084655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407174.261872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407174.523397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407174.666738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407174.892535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407175.039375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407175.275717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407175.429856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407175.648677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407175.818187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407176.018420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407176.173135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407176.392659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407176.581836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407176.812778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407176.931810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407177.118669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407177.326057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407177.558954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407177.768057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407177.965225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407178.214964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407178.387079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407178.519691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407178.721825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407178.924205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407179.101634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407179.347043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407179.498869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407179.718010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407179.885895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407180.091896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407180.260640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407180.518172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407180.681921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407180.879390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407181.047852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407181.256081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407181.414321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407181.634883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407181.828314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407182.060023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407182.187491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407182.413572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407182.560746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407182.762282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407182.955690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407183.159772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407183.347463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407183.543731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407183.697995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407183.866761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407184.046622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407184.279845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407184.476712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407184.669189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407184.837523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407185.031488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407185.210895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407185.415606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407185.591687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407185.803933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407185.968803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407186.250972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407186.411476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407186.603468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407186.776122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407187.000682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407187.185547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407187.354056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407187.546671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407187.782669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407187.947942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407188.162203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407188.331755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407188.561642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407188.732261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407188.903909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407189.085686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407189.310802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407189.493155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407189.682511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407189.841214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407190.052635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407190.206510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407190.414096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407190.600669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407190.794563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407190.964565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407191.215362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407191.331207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407191.548198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407191.725171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407191.953576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407192.140453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407192.309919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407192.468402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407192.701247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407192.867990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407193.099528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407193.259319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407193.464594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407193.639974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407193.826189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407194.015767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407194.223482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407194.395638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407194.600844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407194.766959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407194.976490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407195.163493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407195.395289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407195.566506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407195.775442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407195.942667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407196.192721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407196.326230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407196.534626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407196.703372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407196.926546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407197.072766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407197.284487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407197.460601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407197.693125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407197.846443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407198.085938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407198.254300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407198.477476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407198.655873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407198.850734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407199.013985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407199.243624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407199.401928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407199.633317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407199.792019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407200.024667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407200.168144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407200.374285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407200.567257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407200.790361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407200.952113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407201.224958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407201.400180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407201.600978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407201.788412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407201.979067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407202.148295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407202.355951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407202.537781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407202.768154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407202.890989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407203.067657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407203.319623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407203.495548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407203.711100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407203.895619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407204.099767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407204.266683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407204.493687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407204.658627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407204.910694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407205.097819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407205.320541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407205.480038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407205.706547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407205.886135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407206.113861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407206.260125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407206.450513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407206.696787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407206.908982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407207.120739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407207.342156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407207.583487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407207.779496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407208.006608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407208.177844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407208.396579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407208.584098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407208.774044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407208.943094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407209.182054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407209.347348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407209.543837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407209.714946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407209.918316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407210.106333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407210.326599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407210.500910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407210.712059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407210.896235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407211.135773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407211.293517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407211.519830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407211.701514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407211.892403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407212.057988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407212.287935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407212.454630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407212.661044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407212.840181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407213.059243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407213.222853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407213.460415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407213.640916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407213.826705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407214.012322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407214.210903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407214.376823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407214.597689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407214.768767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407214.963122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407215.146698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407215.374544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407215.558590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407215.752198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407215.903699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407216.153038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407216.435502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407216.598134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407216.766614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407216.990860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407217.181821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407217.453898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407217.588450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407217.747030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407217.968822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407218.204466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407218.413454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407218.682342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407218.874420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407219.118913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407219.244718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407219.462752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407219.620479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407219.825778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407220.043345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407220.244563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407220.475467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407220.792432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407221.095825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407221.387541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407221.654902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407221.906829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407222.220525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407222.490066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407222.756737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407223.031277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407223.277225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407223.490623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407223.848290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407224.014352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407224.256658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407224.394504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407224.617308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407224.772178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407224.991303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407225.178194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407225.404875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407225.593954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407225.813246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407225.959470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407226.205596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407226.378069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407226.593989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407226.766243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407226.979271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407227.143758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407227.367139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407227.527114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407227.740737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407227.931118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407228.129167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407228.288056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407228.540306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407228.705604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407228.891636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407229.079479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407229.325548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407229.514574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407229.733769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407229.872940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407230.084879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407230.273314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407230.487520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407230.638985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407230.839700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407231.023911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407231.308447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407231.472632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407231.701905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407231.857170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407232.078301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407232.247834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407232.474323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407232.663125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407232.891598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407233.019419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407233.220617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407233.413420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407233.639917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407233.810585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407234.079647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407234.370020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407234.526147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407234.877455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407235.072480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407235.284129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407235.473660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407235.662956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407235.834750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407236.043274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407236.214771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407236.416275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407236.582613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407236.848177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407237.001299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407237.255008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407237.397671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407237.538220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407237.836125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407238.109066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407238.344394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407238.578289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407238.812596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407239.020759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407239.256593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407239.480751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407239.755756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407239.980929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407240.202488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407240.445729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407240.720207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407240.918334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407241.158367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407241.284162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407241.471892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407241.701735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407241.911684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407242.162280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407242.305551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407242.514548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407242.710498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407242.959315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407243.161300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407243.373851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407243.602948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407243.805491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407244.034904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407244.284318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407244.474950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407244.711255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407244.892655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407245.069444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407245.232799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407245.465344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407245.618720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407245.840905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407246.016163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407246.213013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407246.463541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407246.678347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407246.875093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407247.115959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407247.253808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407247.508648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407247.649502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407247.857757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407248.022270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407248.265402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407248.404894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407248.578144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407248.799259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407249.034183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407249.220376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407249.455307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407249.594597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407249.784131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407249.967975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407250.182607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407250.364778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407250.559761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407250.743139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407250.975286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407251.123764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407251.343729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407251.521455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407251.751978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407251.911833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407252.141116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407252.307116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407252.554851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407252.714667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407252.905792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407253.076138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407253.304967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407253.458837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407253.675748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407253.870338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407254.069536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407254.244071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407254.463289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407254.598029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407254.776451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407255.013085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407255.213706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407255.456908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407255.607153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407255.812684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407255.964399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407256.193860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407256.359268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407256.578987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407256.736950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407256.966701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407257.136443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407257.336828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407257.503644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407257.725763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407257.897068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407258.100416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407258.272469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407258.514671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407258.685447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407258.896456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407259.077628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407259.285969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407259.432485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407259.661064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407259.838773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407260.054721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407260.220553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407260.457315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407260.633162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407260.851002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407261.005324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407261.323529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407261.452169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407261.687795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407261.837627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407262.052173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407262.229213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407262.454022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407262.606498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407262.821490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407262.973640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407263.182077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407263.343124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407263.570656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407263.714419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407263.946260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407264.119684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407264.315452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407264.475861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407264.744501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407264.868278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407265.051648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407265.278710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407265.476457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407265.702765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407265.859703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407266.049820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407266.223391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407266.461751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407266.617699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407266.843915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407267.018129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407267.214985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407267.412414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407267.609221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407267.774375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407268.018906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407268.147060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407268.322514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407268.534317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407268.728264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407268.992773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407269.118700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407269.301794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407269.530468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407269.782438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407270.031044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407270.260643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407270.448422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407270.679914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407270.841025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407271.041447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407271.212536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407271.405779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407271.578953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407271.803560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407271.958137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407272.180051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407272.352067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407272.589738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407272.744224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407272.949125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407273.097290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407273.326085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407273.472639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407273.691190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407273.884255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407274.085967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407274.251960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407274.405036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407274.615493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407274.834508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407275.049665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407275.288500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407275.509981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407275.744471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407275.990286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407276.307665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407276.583256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407276.784757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407277.022621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407277.149482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407277.325174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407277.527415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407277.746427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407277.897444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407278.163348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407278.299970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407278.458987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407278.667108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407278.910803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407279.165650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407279.392589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407279.592249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407279.835528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407279.980629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407280.201224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407280.390667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407280.602343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407280.767410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407281.012209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407281.159001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407281.400859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407281.541883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407281.735043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407281.901802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407282.131300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407282.306418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407282.454820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407282.688740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407282.922564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407283.121144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407283.356740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407283.514466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407283.725735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407283.906534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407284.133115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407284.284760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407284.514872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407284.670487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407284.906658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407285.057085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407285.246836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407285.443579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407285.659474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407285.810216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407286.048299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407286.349025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407286.657121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407287.038566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407287.296562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407287.624285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407288.066808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407288.456254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407288.664045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407288.940963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407289.191073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407289.457342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407289.714242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407289.946363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407290.185449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407290.469673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407290.734066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407291.101437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407291.456123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407291.571858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407291.927075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407292.179349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407292.400557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407292.708754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407292.969341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407293.167904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407293.451666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407293.639275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407293.893997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407294.036276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407294.223201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407294.395114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407294.619949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407294.763183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407294.969484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407295.149045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407295.388280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407295.529574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407295.760769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407295.931881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407296.149726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407296.281756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407296.500765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407296.681338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407296.905086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407297.055644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407297.271584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407297.452895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407297.651283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407297.807009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407298.053811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407298.219315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407298.404670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407298.578526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407298.780311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407298.969260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407299.161019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407299.337073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407299.571628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407299.722971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407299.926479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407300.114837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407300.333830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407300.487987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407300.680490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407300.868065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407301.036201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407301.232604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407301.456195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407301.613930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407301.826310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407302.029631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407302.256265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407302.398936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407302.615905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407302.807042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407303.016659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407303.175793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407303.392987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407303.531180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407303.758606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407303.917894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407304.139216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407304.302630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407304.536593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407304.715633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407304.888227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407305.075104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407305.281890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407305.439213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407305.643139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407305.834570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407306.015290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407306.173749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407306.471226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407306.641964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407306.850899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407307.011775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407307.221478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407307.387803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407307.612342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407307.770491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407307.972012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407308.147350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407308.353236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407308.516525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407308.710678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407308.889861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407309.110738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407309.273500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407309.458082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407309.648025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407309.879638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407310.063832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407310.269025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407310.415752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407310.632673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407310.783772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407310.948615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407311.179512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407311.398692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407311.614867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407311.865843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407312.080933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407312.327571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407312.573981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407312.761146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407313.017532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407313.145738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407313.373743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407313.514645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407313.675399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407313.885110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407314.119111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407314.320010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407314.535628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407314.702586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407314.909231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407315.056823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407315.308311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407315.460438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407315.679273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407315.848629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407316.039368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407316.226858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407316.455192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407316.617200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407316.804694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407316.980330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407317.203702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407317.352596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407317.546589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407317.712592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407317.961514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407318.097205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407318.317173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407318.525012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407318.743730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407319.133132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407319.500934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407320.037667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407320.496074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407320.776031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407321.164665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407321.411078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407321.905771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407322.246477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407322.539449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407322.883750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407323.046315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407323.372841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407323.639978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407323.944377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407324.203308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407324.419026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407324.595434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407324.765298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407324.918482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407325.042557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407325.179377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407325.319503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407325.436932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407325.567840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407325.696122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407325.827169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407326.007385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407326.186968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407326.326792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407326.456269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407326.597146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407326.829264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407327.002523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407327.135118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407327.274419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407327.414270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407327.578326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407327.710811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407327.825332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407327.985510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407328.182595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407328.525728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407328.782791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407328.946929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407329.139834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407329.288863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407329.446955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407329.567259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407329.710989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407329.827578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407329.951367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407330.096551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407330.214230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407330.333702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407330.476277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407330.589129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407330.868040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407331.159614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407331.385729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407331.536581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407331.696166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407331.862078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407332.013966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407332.160455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407332.366032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407332.675763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407332.971851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407333.155939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407333.483529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407333.756311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407334.057232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407334.202421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407334.366702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407334.530299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407334.718165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407334.864318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407335.001671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407335.128906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407335.265749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407335.379179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407335.525781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407335.673115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407335.778655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407335.907527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407336.032205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407336.160380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407336.305526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407336.440096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407336.570313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407336.715089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407336.826994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407336.949853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407337.077840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407337.201050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407337.325499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407337.635097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407337.791080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407338.129998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407338.421587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407338.703225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407339.076190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407339.247692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407339.399021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407339.575274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407339.737847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407339.873366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407340.012516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407340.137895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407340.267949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407340.427530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407340.703160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407340.976326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407341.305085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407341.458792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407341.592368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407341.743539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407341.893514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407342.016489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407342.185281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407342.328165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407342.484845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407342.754734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407342.946688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407343.160584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407343.336465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407343.644572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407343.794394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407344.039580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407344.352692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407344.722982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407345.128382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407345.270458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407345.443208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407345.618152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407345.752722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407345.870315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407346.019703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407346.153298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407346.313571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407346.453995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407346.595101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407346.737113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407346.858428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407346.994935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407347.132494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407347.254722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407347.381125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407347.501849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407347.641169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407347.773804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407347.900270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407348.047759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407348.199615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407348.322760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407348.476764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407348.583615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407348.717755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407348.850034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407349.006157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407349.143774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407349.301817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407349.429059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407349.580801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407349.718983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407349.864349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407349.986837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407350.144056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407350.298054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407350.427357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407350.552610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407350.683941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407350.819393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407350.985934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407351.218966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407351.468316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407351.718763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407351.962697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407352.197873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407352.343995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407352.470198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407352.718588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407352.877327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407353.004883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407353.131790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407353.261529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407353.386578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407353.517941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407353.633109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407353.759519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407353.889612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407354.022380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407354.144974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407354.283833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407354.410136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407354.576282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407354.763911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407354.932855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407355.100685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407355.260430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407355.376064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407355.513156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407355.625591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407355.768611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407355.905926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407356.012458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407356.160428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407356.269469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407356.400430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407356.525272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407356.662094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407356.792133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407356.929183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407357.072434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407357.300496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407357.533102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407357.680749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407357.826122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407357.954588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407358.081103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407358.226659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407358.468249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407358.574826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407358.697203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407358.833255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407358.953775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407359.080020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407359.210487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407359.334202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407359.461979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407359.585122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407359.709888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407359.850201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407359.978104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407360.107601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407360.253589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407360.383240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407360.518969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407360.636287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407360.814699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407360.932640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407361.073545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407361.186365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407361.319063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407361.438814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407361.567071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407361.695857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407361.820847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407361.963003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407362.077903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407362.211473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407362.328669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407362.453226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407362.579916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407362.705004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407362.835550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407362.967339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407363.097508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407363.238109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407363.369533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407363.521946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407363.646997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407363.771911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407363.896174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407364.022575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407364.152057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407364.274841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407364.413540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407364.556839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407364.691618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407364.821673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407364.944668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407365.071203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407365.201594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407365.329833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407365.444249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407365.576682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407365.704962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407365.831404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407365.956240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407366.086282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407366.220419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407366.346795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407366.469659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407366.592171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407366.716437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407366.851931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407366.969100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407367.099513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407367.246890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407367.374866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407367.500205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407367.634501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407367.755726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407367.883150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407368.006260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407368.135995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407368.263359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407368.384954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407368.516357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407368.638304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407368.771737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407368.884419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407369.010909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407369.142785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407369.266996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407369.387522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407369.531778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407369.638469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407369.781111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407369.892505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407370.022164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407370.155880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407370.303365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407370.426079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407370.577472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407370.690161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407370.820746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407370.950420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407371.081730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407371.200726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407371.334783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407371.478796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407371.600808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407371.740767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407371.881885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407372.014636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407372.135234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407372.261670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407372.392963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407372.547623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407372.677891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407372.798868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407372.920747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407373.055542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407373.185785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407373.305863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407373.437116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407373.566647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407373.697311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407373.823800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407373.955149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407374.083882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407374.210107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407374.334884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407374.467288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407374.587317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407374.724606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407374.863352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407375.003860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407375.118376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407375.260505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407375.385205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407375.525706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407375.628760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407375.759726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407375.886948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407376.016688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407376.142443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407376.269089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407376.393661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407376.520017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407376.643171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407376.767847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407376.895668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407377.021919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407377.147848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407377.282885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407377.411873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407377.562223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407377.693931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407377.828088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407377.949575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407378.078519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407378.200850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407378.342596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407378.456105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407378.587877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407378.714747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407378.845745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407378.988698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407379.125952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407379.251450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407379.370847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407379.493281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407379.654404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407379.763998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407379.895623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407380.017453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407380.142603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407380.273876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407380.404138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407380.541599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407380.678624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407380.813111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407380.955173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407381.075331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407381.197882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407381.333717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407381.449170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407381.580067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407381.756190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407381.862478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407381.993574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407382.127819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407382.271521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407382.392502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407382.511318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407382.637503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407382.780323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407382.893304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407383.014855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407383.146702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407383.269627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407383.404163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407383.534158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407383.670756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407383.818736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407383.949458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407384.070350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407384.190828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407384.320075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407384.450880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407384.577893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407384.703170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407384.845313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407384.960145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407385.079781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407385.206528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407385.334617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407385.459574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407385.584829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407385.708196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407385.849728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407385.970989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407386.106478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407386.218647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407386.352388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407386.487495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407386.619133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407386.756519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407386.903475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407387.017308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407387.136863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407387.267539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407387.392380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407387.517593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407387.654963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407387.782799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407387.929215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407388.056712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407388.187665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407388.320240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407388.441175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407388.569672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407388.696184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407388.813721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407388.938294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407389.074006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407389.197020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407389.324605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407389.468203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407389.577207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407389.697711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407389.826833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407389.958612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407390.078455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407390.216384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407390.330713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407390.465482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407390.592287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407390.734765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407390.843143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407390.972800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407391.115479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407391.252417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407391.375260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407391.506227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407391.646333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407391.765240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407391.886274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407392.017105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407392.151891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407392.277822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407392.406884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407392.553374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407392.684671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407392.811723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407392.945729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407393.091410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407393.197839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407393.324991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407393.452793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407393.580959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407393.720074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407393.841273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407393.969459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407394.091150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407394.223428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407394.365896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407394.491618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407394.619943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407394.746783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407394.888520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407395.011970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407395.129842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407395.258697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407395.388641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407395.515700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407395.649665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407395.784209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407395.937591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407396.058697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407396.187644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407396.332631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407396.443277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407396.569653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407396.702459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407396.837503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407396.953887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407397.086481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407397.210689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407397.333740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407397.466692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407397.594180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407397.741510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407397.856972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407397.991136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407398.118209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407398.260334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407398.386286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407398.509654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407398.628369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407398.763306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407398.882096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407399.008718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407399.147039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407399.259740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407399.388159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407399.519164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407399.638805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407399.764858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407399.888806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407400.015879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407400.146321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407400.276883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407400.398858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407400.530899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407400.656905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407400.799562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407400.918474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407401.072654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407401.194097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407401.324669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407401.454730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407401.595900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407401.716700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407401.826344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407401.953961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407402.082327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407402.206676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407402.330797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407402.457622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407402.588956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407402.715609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407402.847295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407402.976245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407403.125272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407403.242053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407403.368081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407403.495540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407403.629663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407403.760245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407403.904925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407404.011127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407404.143710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407404.264438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407404.406123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407404.512662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407404.629955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407404.764807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407404.889878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407405.012545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407405.154138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407405.279540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407405.411855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407405.566074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407405.676898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407405.810965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407405.945802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407406.080637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407406.191686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407406.321072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407406.450521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407406.576252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407406.701514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407406.826872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407406.950022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407407.082847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407407.199457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407407.342130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407407.458349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407407.571713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407407.696088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407407.842562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407407.951373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407408.081213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407408.206735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407408.338480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407408.469649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407408.607105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407408.725006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407408.859756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407409.001833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407409.123771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407409.252209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407409.378459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407409.499986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407409.631004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407409.759126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407409.881039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407410.017881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407410.137151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407410.279610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407410.390353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407410.522717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407410.644820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407410.785006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407410.907344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407411.035411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407411.163618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407411.309440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407411.438838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407411.570940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407411.707493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407411.870617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407411.991196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407412.125347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407412.248085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407412.376186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407412.508043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407412.638785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407412.760552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407412.883118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407413.006823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407413.139253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407413.269624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407413.389080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407413.522328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407413.644207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407413.771673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407413.896344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407414.028324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407414.169010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407414.285838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407414.408810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407414.547364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407414.676828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407414.813975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407414.944741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407415.078003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407415.189752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407415.319229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407415.451633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407415.570112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407415.703131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407415.826078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407415.943539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407416.079791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407416.208522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407416.339565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407416.469582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407416.613241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407416.730617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407416.864292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407416.994678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407417.126840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407417.256799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407417.381290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407417.511289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407417.639814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407417.769732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407417.906382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407418.027157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407418.150901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407418.293150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407418.424864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407418.558467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407418.678707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407418.822133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407418.944301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407419.064550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407419.198894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407419.319158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407419.440054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407419.567634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407419.696712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407419.824092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407419.951435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407420.074531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407420.191635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407420.323830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407420.459503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407420.579114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407420.715595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407420.829640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407420.954901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407421.085619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407421.226498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407421.368526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407421.490104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407421.646025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407421.754983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407421.902786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407422.010355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407422.139777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407422.272247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407422.387715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407422.515114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407422.637132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407422.762513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407422.888071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407423.028912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407423.144567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407423.266914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407423.395072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407423.517955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407423.644999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407423.769231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407423.897044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407424.031062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407424.151239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407424.277671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407424.408479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407424.531943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407424.656090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407424.788863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407424.915717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407425.062540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407425.184839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407425.305077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407425.436180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407425.561543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407425.699592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407425.831200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407425.962646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407426.090662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407426.206881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407426.334828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407426.459213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407426.591640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407426.719743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407426.851342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407427.007013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407427.122258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407427.253189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407427.386101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407427.515966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407427.641109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407427.769986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407427.900680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407428.033920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407428.154079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407428.283000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407428.412507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407428.552621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407428.678415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407428.801539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407428.935028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407429.057290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407429.182612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407429.303448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407429.427954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407429.559426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407429.688061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407429.813539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407429.943246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407430.078778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407430.192001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407430.322783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407430.452237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407430.580638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407430.713320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407430.841186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407430.967454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407431.098591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407431.224691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407431.368344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407431.492792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407431.619391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407431.759372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407431.892182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407432.027520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407432.143759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407432.267435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407432.398756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407432.528016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407432.656657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407432.787302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407432.934697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407433.055043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407433.186012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407433.318453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407433.446065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407433.572541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407433.697809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407433.824163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407433.950140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407434.073258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407434.204087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407434.328852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407434.451711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407434.581007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407434.713617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407434.848356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407434.967828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407435.107002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407435.239859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407435.376354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407435.503618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407435.622550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407435.747082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407435.882190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407436.012664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407436.131739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407436.257091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407436.402752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407436.524046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407436.635984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407436.764130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407436.890777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407437.021778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407437.160880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407437.281723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407437.407203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407437.535470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407437.671709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407437.815858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407437.945796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407438.071010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407438.209523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407438.324645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407438.468453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407438.575431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407438.696681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407438.843473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407438.948260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407439.125814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407439.283720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407439.410843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407439.551306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407439.716523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407439.924892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407440.214906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407440.549876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407440.803247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407440.956447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407441.123948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407441.247583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407441.401596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407441.578232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407441.809928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407441.946320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407442.091069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407442.264760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407442.567563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407442.719927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407442.844720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407442.982749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407443.102582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407443.249770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407443.375899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407443.506171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407443.642696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407443.801325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407443.930302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407444.055825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407444.191495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407444.324933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407444.445177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407444.563659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407444.697718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407444.825832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407444.949689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407445.066254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407445.204500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407445.325006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407445.451923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407445.573363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407445.696949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407445.823587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407445.950156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407446.074123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407446.219548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407446.331708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407446.457731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407446.587907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407446.719601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407446.858262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407446.990513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407447.112065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407447.256234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407447.378010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407447.512918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407447.639159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407447.764285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407447.892117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407448.017114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407448.142078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407448.266478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407448.391040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407448.535931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407448.647056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407448.780861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407448.905831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407449.038605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407449.161457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407449.303212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407449.438619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407449.557657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407449.709017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407449.837984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407449.965303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407450.093468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407450.221010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407450.365752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407450.492880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407450.615991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407450.767529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407450.884554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407451.009902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407451.135002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407451.260041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407451.384304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407451.510936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407451.648675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407451.769330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407451.905529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407452.028360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407452.153520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407452.279341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407452.410965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407452.550793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407452.708671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407452.846512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407453.027073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407453.315465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407453.657547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407453.949264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407454.185126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407454.408761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407454.533669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407454.704832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407454.901129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407455.152642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407455.306957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407455.440756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407455.600612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407455.820918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407456.076661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407456.276867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407456.440704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407456.563991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407456.697736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407456.823627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407456.950764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407457.078467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407457.207419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407457.332023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407457.464382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407457.598362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407457.736125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407457.864409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407458.010580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407458.130098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407458.258506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407458.383372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407458.510828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407458.637574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407458.765730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407458.891063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407459.008809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407459.134978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407459.263748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407459.395911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407459.521357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407459.645337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407459.778235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407459.905957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407460.069572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407460.186808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407460.330462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407460.449922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407460.577286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407460.694762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407460.825956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407460.961665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407461.075708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407461.214751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407461.322288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407461.516883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407461.661144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407461.828129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407461.986675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407462.126803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407462.280936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407462.405967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407462.534633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407462.681436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407462.823311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407463.043524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407463.274823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407463.521326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407463.708080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407463.841249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407463.972294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407464.114111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407464.253502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407464.380602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407464.498152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407464.628667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407464.750092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407464.882472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407464.996692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407465.134714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407465.251657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407465.385730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407465.510420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407465.632242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407465.751185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407465.885775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407466.010834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407466.152240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407466.253352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407466.385182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407466.513711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407466.642099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407466.774925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407466.908824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407467.044929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407467.170050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407467.306856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407467.436590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407467.557784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407467.684671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407467.815253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407467.940349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407468.063553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407468.200820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407468.322360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407468.452149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407468.576017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407468.696064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407468.818880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407468.951157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407469.069759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407469.198594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407469.333079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407469.452932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407469.573483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407469.704901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407469.839084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407469.967293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407470.096462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407470.236438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407470.374329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407470.481225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407470.616447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407470.749265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407470.883875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407471.014117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407471.154649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407471.263710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407471.401563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407471.512995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407471.635103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407471.781263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407471.903326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407472.027114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407472.154441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407472.302631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407472.421677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407472.558294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407472.693678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407472.823255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407472.951784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407473.083630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407473.208388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407473.355094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407473.471990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407473.606834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407473.731012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407473.882146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407474.009697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407474.128564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407474.248466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407474.380865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407474.515658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407474.641575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407474.765496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407474.904865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407475.162788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407475.331611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407475.488482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407475.647019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407475.800940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407475.911384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407476.051237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407476.175106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407476.307515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407476.433011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407476.561778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407476.696671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407476.812833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407476.939668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407477.071015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407477.189805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407477.317068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407477.446013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407477.575437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407477.694624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407477.822887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407477.945017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407478.075963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407478.195381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407478.324778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407478.451736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407478.572477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407478.700866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407478.930756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407479.077638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407479.198405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407479.313981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407479.446138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407479.570134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407479.692600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407479.816231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407479.941496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407480.069825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407480.195147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407480.322359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407480.449133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407480.587679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407480.705007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407480.824466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407480.988024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407481.076022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407481.198981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407481.326905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407481.464311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407481.577097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407481.704468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407481.827611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407481.955980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407482.079045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407482.207698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407482.342597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407482.461685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407482.580374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407482.718022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407482.840683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407482.981183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407483.127675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407483.258810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407483.378230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407483.508901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407483.640980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407483.753613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407483.880943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407484.017459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407484.141153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407484.265254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407484.409069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407484.516756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407484.653235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407484.765921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407484.895828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407485.019009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407485.143679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407485.270034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407485.396014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407485.529351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407485.656188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407485.791061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407485.924378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407486.054906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407486.177824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407486.309139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407486.445820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407486.563810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407486.682238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407486.802665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407486.939200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407487.071017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407487.196549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407487.337938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407487.451330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407487.577715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407487.698081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407487.827992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407487.953515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407488.079738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407488.205146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407488.333182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407488.455787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407488.584618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407488.705357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407488.831064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407488.957677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407489.096864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407489.215519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407489.363291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407489.487042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407489.624125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407489.739668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407489.879065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407489.996695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407490.133930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407490.259375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407490.393734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407490.509498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407490.636810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407490.775988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407490.903121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407491.044027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407491.168712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407491.285451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407491.427055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407491.569734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407491.698362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407491.821631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407491.951158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407492.068846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407492.211925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407492.321620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407492.442772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407492.572947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407492.694690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407492.820481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407492.949920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407493.068611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407493.202278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407493.325548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407493.471721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407493.599844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407493.721350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407493.859257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407493.994432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407494.112111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407494.257025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407494.369477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407494.506599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407494.633564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407494.768608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407494.882297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407495.003567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407495.143021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407495.261209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407495.385954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407495.520885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407495.633224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407495.761135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407495.885487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407496.013508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407496.138353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407496.263843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407496.394396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407496.518234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407496.642270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407496.765996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407496.893446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407497.028920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407497.160666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407497.283714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407497.416136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407497.549925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407497.684677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407497.836356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407497.943756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407498.065842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407498.192027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407498.316373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407498.438669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407498.573951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407498.696488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407498.829102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407498.951200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407499.084584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407499.207280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407499.343498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407499.469024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407499.623382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407499.751027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407499.882239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407499.998964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407500.130864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407500.249492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407500.374286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407500.502382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407500.634910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407500.746673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407500.883048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407501.014019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407501.135269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407501.257725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407501.393107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407501.509347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407501.640885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407501.794986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407501.926388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407502.046359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407502.179432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407502.306129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407502.453622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407502.574467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407502.702200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407502.828186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407502.956141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407503.083877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407503.217094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407503.342513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407503.487526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407503.624861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407503.759270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407503.882927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407504.013135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407504.138771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407504.264197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407504.387978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407504.512659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407504.643666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407504.775978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407504.901960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407505.079530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407505.217524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407505.359095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407505.486531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407505.624697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407505.750934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407505.882276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407506.004063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407506.136583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407506.258748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407506.390114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407506.516784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407506.651035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407506.779243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407506.921503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407507.048439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407507.183556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407507.297967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407507.426416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407507.566443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407507.697598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407507.815891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407507.963145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407508.069526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407508.207195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407508.324547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407508.447729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407508.571970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407508.702556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407508.830448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407508.961987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407509.082359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407509.212069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407509.330528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407509.466273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407509.589644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407509.733927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407509.854908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407510.002475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407510.126668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407510.256677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407510.379700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407510.509796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407510.631786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407510.755437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407510.902685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407511.014047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407511.146380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407511.259925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407511.398448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407511.511302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407511.640936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407511.778646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407511.897056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407512.031991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407512.159069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407512.296674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407512.425098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407512.558815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407512.692036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407512.812781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407512.935622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407513.071067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407513.206373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407513.324308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407513.442022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407513.587233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407513.696299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407513.814371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407513.938275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407514.070040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407514.191004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407514.324555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407514.441805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407514.571890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407514.714007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407514.831709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407514.954348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407515.093781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407515.228588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407515.352459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407515.489238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407515.620696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407515.770086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407515.885220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407516.013536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407516.148346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407516.276115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407516.424165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407516.529863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407516.680270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407516.802166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407516.926114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407517.053973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407517.192480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407517.316772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407517.439088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407517.559148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407517.688850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407517.809698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407517.938057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407518.060295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407518.212793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407518.316688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407518.440633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407518.564875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407518.693604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407518.820022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407518.936585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407519.062396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407519.192837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407519.321450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407519.454612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407519.589281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407519.715350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407519.826751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407519.950250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407520.096694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407520.228521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407520.349494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407520.487111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407520.618792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407520.765332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407520.882524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407521.006174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407521.147051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407521.260403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407521.386612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407521.511344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407521.634902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407521.760503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407521.892211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407522.027349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407522.150691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407522.277204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407522.410042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407522.534773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407522.666615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407522.804903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407522.930827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407523.052556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407523.179178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407523.317165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407523.441543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407523.571758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407523.685483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407523.822109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407523.946875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407524.066295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407524.191324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407524.322745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407524.443099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407524.572017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407524.707836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407524.834998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407524.953743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407525.082112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407525.214157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407525.336773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407525.465235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407525.596629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407525.730308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407525.845977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407526.004042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407526.116221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407526.239471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407526.378801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407526.497659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407526.620758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407526.756066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407526.891434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407526.999966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407527.136214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407527.259190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407527.391296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407527.507023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407527.636563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407527.761128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407527.903510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407528.022959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407528.147913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407528.289329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407528.410659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407528.549726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407528.688031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407528.808933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407528.938227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407529.067015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407529.194001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407529.317337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407529.445025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407529.567907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407529.698094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407529.817569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407529.949275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407530.065499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407530.199150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407530.320545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407530.465227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407530.575263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407530.700880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407530.822888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407530.952993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407531.079190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407531.204253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407531.329487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407531.455989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407531.586370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407531.734613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407531.864134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407531.989318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407532.126451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407532.256383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407532.390818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407532.507140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407532.641997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407532.761152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407532.877915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407533.010575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407533.148868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407533.272772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407533.380809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407533.525472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407533.628608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407533.773871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407533.895127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407534.014944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407534.140914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407534.266650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407534.415745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407534.535624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407534.675617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407534.823221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407534.922644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407535.053504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407535.183253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407535.314986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407535.441813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407535.570399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407535.692077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407535.820546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407535.952498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407536.081482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407536.213293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407536.339261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407536.465994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407536.604550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407536.718672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407536.862212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407537.013519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407537.142180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407537.247109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407537.386648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407537.511379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407537.641279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407537.763309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407537.899749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407538.042799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407538.174578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407538.306952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407538.426369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407538.565269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407538.711899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407538.823607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407538.943133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407539.076670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407539.232219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407539.334510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407539.490739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407539.607587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407539.742063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407539.877295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407539.998911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407540.125562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407540.255417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407540.378219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407540.511911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407540.621812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407540.747566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407540.881034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407541.007360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407541.127018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407541.251113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407541.372112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407541.500653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407541.625981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407541.758354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407541.870639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407542.001972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407542.125799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407542.255397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407542.377475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407542.504934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407542.630728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407542.774779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407542.886947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407543.007004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407543.133760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407543.262940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407543.381497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407543.514941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407543.631452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407543.768086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407543.880141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407544.008273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407544.137829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407544.260010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407544.379545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407544.511999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407544.630536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407544.761128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407544.887025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407545.011256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407545.129633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407545.260047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407545.385987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407545.504840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407545.632872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407545.763350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407545.902065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407546.014911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407546.140186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407546.269540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407546.394186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407546.519293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407546.651302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407546.791351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407546.902456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407547.028894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407547.151543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407547.301236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407547.422021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407547.554321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407547.689509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407547.820113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407547.942741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407548.071373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407548.194755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407548.325012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407548.444848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407548.574923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407548.699698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407548.827537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407548.959048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407549.092664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407549.229337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407549.354371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407549.506076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407549.633450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407549.755183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407549.882447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407550.014216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407550.134336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407550.258165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407550.404992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407550.517930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407550.650536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407550.775177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407550.904711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407551.024334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407551.155200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407551.295815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407551.448981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407551.564969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407551.710247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407551.827057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407551.983809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407552.103961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407552.243995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407552.362021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407552.497605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407552.627219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407552.751190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407552.894152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407553.015915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407553.132664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407553.259823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407553.392006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407553.526956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407553.633500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407553.760792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407553.889724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407554.019424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407554.151566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407554.279655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407554.412104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407554.547938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407554.679128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407554.810263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407554.930652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407555.059325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407555.187727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407555.313730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407555.439433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407555.570993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407555.709699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407555.827857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407555.963689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407556.075043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407556.193369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407556.334042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407556.455116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407556.579167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407556.711318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407556.845177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407556.967348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407557.100977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407557.235135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407557.360770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407557.494605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407557.630929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407557.759429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407557.890004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407558.011950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407558.152683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407558.268300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407558.394315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407558.537645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407558.657666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407558.774144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407558.907534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407559.041957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407559.173699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407559.302324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407559.430210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407559.553560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407559.695015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407559.827897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407559.955959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407560.076868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407560.214535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407560.339911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407560.469668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407560.596534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407560.737060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407560.863362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407561.010000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407561.136119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407561.276625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407561.383959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407561.513704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407561.636892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407561.801089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407561.923347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407562.047692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407562.181889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407562.316923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407562.433051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407562.562331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407562.696832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407562.827155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407562.943868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407563.069484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407563.199447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407563.322224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407563.445967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407563.569660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407563.692405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407563.844175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407563.949101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407564.082020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407564.209876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407564.337541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407564.483347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407564.610187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407564.747054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407564.882877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407565.024971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407565.136044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407565.259206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407565.390985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407565.507138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407565.632517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407565.760167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407565.901643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407566.016220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407566.145837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407566.281870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407566.397429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407566.526289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407566.663727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407566.788214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407566.928545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407567.054757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407567.186220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407567.309750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407567.441214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407567.560557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407567.696975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407567.818880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407567.950331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407568.073654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407568.214415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407568.347669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407568.464992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407568.601509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407568.722386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407568.869117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407569.010232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407569.127627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407569.247591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407569.366202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407569.504503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407569.631875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407569.747763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407569.879117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407570.008735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407570.134031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407570.261069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407570.399232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407570.510746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407570.639019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407570.766467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407570.890606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407571.026647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407571.157749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407571.297991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407571.423124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407571.547083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407571.688055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407571.811723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407571.938953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407572.068665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407572.189181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407572.321859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407572.449605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407572.570318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407572.694287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407572.823645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407572.947804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407573.077218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407573.199373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407573.326562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407573.462009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407573.568483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407573.693237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407573.827239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407573.946301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407574.076714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407574.208022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407574.328247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407574.468458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407574.602832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407574.727264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407574.878156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407574.989726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407575.131746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407575.246807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407575.373782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407575.499243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407575.651649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407575.763329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407575.899313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407576.028743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407576.166773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407576.295916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407576.437686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407576.556261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407576.688787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407576.823887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407576.939209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407577.071513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407577.191263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407577.312197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407577.442450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407577.566853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407577.690314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407577.816937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407577.956292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407578.067856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407578.197812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407578.316686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407578.450074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407578.570884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407578.703518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407578.836118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407578.965623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407579.086905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407579.218392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407579.343406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407579.469597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407579.614519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407579.758959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407579.878520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407580.007840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407580.130000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407580.261949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407580.387743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407580.514969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407580.640528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407580.775541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407580.900167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407581.052457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407581.176384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407581.309933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407581.446690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407581.572745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407581.689661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407581.836858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407581.960990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407582.076431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407582.198783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407582.333057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407582.456728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407582.604008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407582.751778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407582.868761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407582.988398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407583.119660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407583.254499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407583.388825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407583.504982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407583.634466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407583.763204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407583.890891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407584.020071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407584.155433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407584.297860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407584.425301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407584.552984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407584.689792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407584.816872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407584.938868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407585.064005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407585.189763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407585.312330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407585.441956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407585.569726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407585.696907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407585.816943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407585.944381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407586.113564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407586.329921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407586.561320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407586.765192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407586.948711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407587.072650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407587.203813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407587.328100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407587.462652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407587.601294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407587.729962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407587.862274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407588.003890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407588.122300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407588.250088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407588.379409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407588.510654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407588.632455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407588.762323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407588.896815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407589.005796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407589.131541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407589.268628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407589.373690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407589.502557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407589.631745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407589.762180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407589.892425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407590.019071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407590.149959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407590.274218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407590.415740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407590.550631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407590.679311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407590.824125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407590.942929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407591.083902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407591.199063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407591.317114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407591.437695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407591.563150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407591.697761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407591.828193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407591.954485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407592.082802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407592.212583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407592.338532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407592.485617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407592.617766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407592.740373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407592.879453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407593.003922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407593.127419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407593.253700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407593.378200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407593.501945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407593.629559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407593.752089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407593.883426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407593.999216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407594.129003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407594.267000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407594.379942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407594.511300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407594.628279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407594.755744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407594.881869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407595.020553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407595.136647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407595.361184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407595.516390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407595.693206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407595.883290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407596.050883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407596.233365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407596.360336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407596.487107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407596.620734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407596.751627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407596.883811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407597.007703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407597.135345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407597.261467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407597.396880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407597.516900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407597.672951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407597.783506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407597.919166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407598.047353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407598.192497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407598.312381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407598.436524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407598.562270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407598.709316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407598.818090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407598.950563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407599.066943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407599.199443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407599.428461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407599.579782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407599.712352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407599.852702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407599.973900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407600.106039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407600.249049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407600.370512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407600.499500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407600.628609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407600.758894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407600.878686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407601.006027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407601.124176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407601.254250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407601.376672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407601.521029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407601.624613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407601.762867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407601.880951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407602.002853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407602.127616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407602.257558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407602.384977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407602.502645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407602.636643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407602.761220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407602.884452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407603.023816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407603.147525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407603.276250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407603.421099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407603.548550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407603.672352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407603.799441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407603.934479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407604.058321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407604.183053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407604.322728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407604.438361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407604.574470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407604.713492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407604.837003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407604.972806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407605.106220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407605.244355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407605.360949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407605.502076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407605.630626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407605.762961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407605.897344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407606.013268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407606.149300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407606.261823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407606.391765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407606.523927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407606.646960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407606.782639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407606.931059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407607.058939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407607.182587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407607.310340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407607.437238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407607.563787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407607.693244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407607.823980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407607.943340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407608.068960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407608.210129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407608.325325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407608.453358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407608.596130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407608.736908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407608.872493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407609.002587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407609.131084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407609.252827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407609.376330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407609.504948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407609.626076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407609.754012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407609.878922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407610.006609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407610.129904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407610.259170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407610.388682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407610.515315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407610.642153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407610.776175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407610.896374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407611.026933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407611.155197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407611.288376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407611.422194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407611.558562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407611.694601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407611.819556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407611.944459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407612.071888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407612.193998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407612.321914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407612.437691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407612.564939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407612.695481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407612.815007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407612.941068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407613.078925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407613.194089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407613.315650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407613.436065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407613.566215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407613.688963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407613.815587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407613.943633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407614.067146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407614.193496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407614.312343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407614.443756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407614.566632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407614.681570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407614.810522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407614.933174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407615.066569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407615.190004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407615.315719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407615.435744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407615.576848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407615.678635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407615.821294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407615.933268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407616.066666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407616.189691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407616.314104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407616.433783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407616.584898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407616.696740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407616.834038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407616.960498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407617.083781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407617.218034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407617.340299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407617.470225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407617.606617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407617.735508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407617.879616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407618.002715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407618.129699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407618.268154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407618.378473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407618.498951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407618.642787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407618.748430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407618.883032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407619.004441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407619.130017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407619.258796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407619.388354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407619.516835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407619.643160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407619.774574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407619.898284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407620.024503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407620.156619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407620.282003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407620.425694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407620.547971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407620.678409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407620.813904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407620.943858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407621.079361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407621.192439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407621.328945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407621.440351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407621.565125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407621.730680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407621.843174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407621.984385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407622.130099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407622.251531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407622.371259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407622.502260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407622.623335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407622.767971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407622.888286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407623.008080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407623.124152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407623.250426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407623.380453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407623.506170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407623.632126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407623.756406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407623.886194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407624.012300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407624.141225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407624.281517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407624.413927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407624.532626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407624.663001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407624.803533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407624.928304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407625.047989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407625.192672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407625.315871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407625.452097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407625.570777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407625.697614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407625.818660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407625.942779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407626.072361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407626.193235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407626.334410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407626.466354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407626.607592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407626.736961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407626.876569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407626.996748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407627.125186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407627.259109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407627.397253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407627.523227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407627.636457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407627.762592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407627.897652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407628.032283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407628.170534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407628.297961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407628.427083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407628.552904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407628.690068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407628.963934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407629.449712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407629.757963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407629.923025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407630.083741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407630.231620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407630.360286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407630.495100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407630.620260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407630.744735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407630.880561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407631.002969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407631.133732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407631.263698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407631.380954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407631.506970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407631.638810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407631.763742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407631.897557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407632.022712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407632.155624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407632.310820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407632.424444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407632.571195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407632.708885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407632.829064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407632.966461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407633.094556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407633.241100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407633.368205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407633.497608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407633.615748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407633.752868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407633.940046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407634.148672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407634.262169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407634.392744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407634.512925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407634.640261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407634.767047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407634.898395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407635.032164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407635.175725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407635.300066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407635.433913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407635.566189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407635.712938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407635.867158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407635.984113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407636.117302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407636.249141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407636.372625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407636.506546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407636.624895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407636.759675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407636.887815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407637.023445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407637.150272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407637.291816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407637.425602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407637.539343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407637.679523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407637.805741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407637.944278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407638.067297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407638.191513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407638.321681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407638.449106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407638.582359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407638.720307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407638.848452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407638.980976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407639.122471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407639.244625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407639.369206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407639.501690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407639.634497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407639.766898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407639.901455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407640.013282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407640.137846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407640.287808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407640.413893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407640.544940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407640.683569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407640.809920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407640.941619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407641.058324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407641.185800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407641.312972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407641.440053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407641.561007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407641.693064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407641.825342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407641.962823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407642.083353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407642.204648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407642.336769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407642.470804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407642.598748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407642.732565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407642.868752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407643.007872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407643.124762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407643.249538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407643.388185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407643.506451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407643.634864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407643.756097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407643.882983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407644.011318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407644.161491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407644.280982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407644.415585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407644.553557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407644.675687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407644.810726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407644.940755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407645.063390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407645.193822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407645.314813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407645.447845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407645.564037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407645.688897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407645.833314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407645.937473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407646.070984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407646.194073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407646.317307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407646.437980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407646.562331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407646.699818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407646.821147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407646.946130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407647.072604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407647.197307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407647.324062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407647.460695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407647.586248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407647.728701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407647.841624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407647.972136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407648.095137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407648.239069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407648.392174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407648.509965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407648.635125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407648.769711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407648.900859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407649.025901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407649.181138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407649.292292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407649.424799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407649.551886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407649.686430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407649.814136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407649.938749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407650.067760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407650.209192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407650.319721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407650.465796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407650.571906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407650.693991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407650.832123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407650.951360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407651.084013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407651.231946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407651.344253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407651.483677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407651.591487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407651.762761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407651.869049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407652.007178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407652.147101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407652.267094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407652.393782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407652.529035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407652.650950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407652.787780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407652.918619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407653.050650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407653.177333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407653.314629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407653.437659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407653.562340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407653.683764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407653.817119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407653.946693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407654.068423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407654.196767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407654.319682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407654.446522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407654.571735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407654.700999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407654.834527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407654.943229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407655.085308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407655.193234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407655.324360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407655.448412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407655.588889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407655.717129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407655.835566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407655.980245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407656.117972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407656.243433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407656.375346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407656.508513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407656.637051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407656.753883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407656.883406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407657.013184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407657.144126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407657.285321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407657.437706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407657.561710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407657.689248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407657.824837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407657.947946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407658.070277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407658.199142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407658.318564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407658.445547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407658.583776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407658.699592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407658.826334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407658.952589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407659.084153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407659.208504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407659.344491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407659.474448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407659.597844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407659.734183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407659.871276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407660.004573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407660.130563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407660.254484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407660.376658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407660.509220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407660.638495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407660.771791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407660.906899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407661.025545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407661.149842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407661.274165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407661.417678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407661.550342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407661.680830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407661.809990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407661.934407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407662.082448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407662.189523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407662.321733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407662.447696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407662.573128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407662.699467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407662.833312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407662.961597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407663.102153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407663.226625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407663.362493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407663.501133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407663.632771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407663.752370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407663.896198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407664.020445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407664.135296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407664.268829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407664.394831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407664.521593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407664.643496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407664.775611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407664.920274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407665.042854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407665.190888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407665.312910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407665.432908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407665.562271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407665.693825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407665.816980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407665.961513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407666.081043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407666.203309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407666.338485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407666.469788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407666.621539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407666.754241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407666.878099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407667.005092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407667.133148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407667.270899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407667.401144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407667.522234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407667.662671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407667.782188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407667.914763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407668.050289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407668.179449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407668.315628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407668.452677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407668.560301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407668.710831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407668.818088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407668.961780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407669.070019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407669.210282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407669.336888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407669.449938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407669.586759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407669.709199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407669.839580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407669.982817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407670.123495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407670.241463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407670.377158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407670.494080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407670.625627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407670.760284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407670.884491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407671.003677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407671.135812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407671.283755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407671.390933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407671.522830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407671.667539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407671.809872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407671.943178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407672.078162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407672.192555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407672.321229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407672.458800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407672.591419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407672.697067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407672.824076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407672.950886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407673.080919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407673.230121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407673.358412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407673.490067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407673.619869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407673.746604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407673.873889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407673.998503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407674.125637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407674.267930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407674.382916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407674.510954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407674.644530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407674.780997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407674.904706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407675.035996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407675.172793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407675.308686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407675.438694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407675.565808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407675.688805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407675.816046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407675.943382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407676.067054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407676.186931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407676.318329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407676.438057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407676.560453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407676.697721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407676.818953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407676.947633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407677.081344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407677.205812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407677.360497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407677.483056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407677.629364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407677.741210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407677.882633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407678.003056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407678.136954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407678.261483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407678.398761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407678.525362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407678.649208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407678.793037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407678.928603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407679.065345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407679.183949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407679.307308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407679.441872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407679.558830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407679.691079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407679.818717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407679.939435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407680.070100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407680.196976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407680.337699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407680.447129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407680.564874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407680.696997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407680.833475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407680.960792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407681.102135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407681.219515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407681.362267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407681.500712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407681.629690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407681.769332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407681.905943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407682.034694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407682.168159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407682.307627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407682.431964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407682.567410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407682.681355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407682.807134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407682.938987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407683.066088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407683.194638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407683.315669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407683.433354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407683.561918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407683.700443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407683.818352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407683.942258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407684.073555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407684.197228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407684.324084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407684.443719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407684.572942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407684.697040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407684.830934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407684.950168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407685.102825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407685.214686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407685.354199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407685.485283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407685.626015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407685.740752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407685.871636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407686.001469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407686.147205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407686.256780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407686.378803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407686.505128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407686.650389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407686.759980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407686.888487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407687.019610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407687.148162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407687.284338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407687.413531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407687.546252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407687.693651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407687.815367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407687.942410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407688.068968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407688.207153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407688.315728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407688.465027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407688.575457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407688.730905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407688.836649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407688.982558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407689.106408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407689.254411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407689.420379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407689.617664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407689.798760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407689.963237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407690.098516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407690.232744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407690.367099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407690.497146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407690.631994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407690.757063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407690.885763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407691.011768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407691.146498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407691.264020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407691.394241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407691.521712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407691.653540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407691.799090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407691.929648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407692.068950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407692.191890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407692.319995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407692.445213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407692.574390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407692.698765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407692.830913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407692.951860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407693.092194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407693.215101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407693.370053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407693.501211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407693.622490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407693.754667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407693.876855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407694.000777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407694.130459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407694.254951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407694.389140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407694.522892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407694.639167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407694.768250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407694.898592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407695.022573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407695.159608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407695.292445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407695.429930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407695.561236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407695.699189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407695.828163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407695.953167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407696.102303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407696.209201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407696.339778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407696.473003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407696.605733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407696.740992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407696.879864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407697.001013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407697.126907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407697.258452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407697.399855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407697.508818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407697.624708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407697.757663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407697.879368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407698.026922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407698.136919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407698.270429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407698.399866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407698.534876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407698.662953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407698.794535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407698.925243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407699.053085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407699.181696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407699.309676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407699.437220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407699.564601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407699.685310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407699.817752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407699.935922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407700.066658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407700.206655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407700.333682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407700.472211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407700.606137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407700.736512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407700.870397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407700.987063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407701.121549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407701.241180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407701.367376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407701.494886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407701.626508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407701.749237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407701.881045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407702.004947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407702.132848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407702.255173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407702.387643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407702.512160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407702.662041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407702.773274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407702.906200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407703.043837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407703.165778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407703.315889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407703.442786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407703.567070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407703.702886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407703.820129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407703.947770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407704.075112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407704.201197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407704.333124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407704.467909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407704.589990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407704.728275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407704.853748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407704.995246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407705.125689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407705.251833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407705.379504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407705.508869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407705.633744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407705.757944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407705.883228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407706.023599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407706.136040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407706.282993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407706.403599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407706.533117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407706.670759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407706.805492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407706.925077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407707.056401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407707.182504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407707.311046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407707.434373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407707.563178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407707.691801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407707.835912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407707.965814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407708.084549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407708.209427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407708.344357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407708.480121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407708.588306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407708.727982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407708.854793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407708.992581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407709.113916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407709.250806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407709.381138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407709.504148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407709.643501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407709.762264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407709.878396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407710.012335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407710.134520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407710.261080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407710.395897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407710.519969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407710.652432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407710.794132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407710.917851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407711.052312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407711.186536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407711.315026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407711.442304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407711.567881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407711.695517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407711.839832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407711.965515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407712.075722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407712.203212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407712.338818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407712.481554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407712.618155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407712.743985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407712.867677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407712.993670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407713.119550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407713.260103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407713.375883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407713.491513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407713.626104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407713.750210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407713.874286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407714.018608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407714.132658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407714.250918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407714.381041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407714.510803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407714.649110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407714.761618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407714.881217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407715.011452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407715.132259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407715.265231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407715.394678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407715.525348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407715.661668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407715.796771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407715.923548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407716.070547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407716.297927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407716.509563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407716.702607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407716.857353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407717.071886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407717.236933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407717.394085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407717.546703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407717.686224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407717.806974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407717.938573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407718.063297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407718.202398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407718.315084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407718.433554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407718.569572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407718.694421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407718.826629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407718.972237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407719.084127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407719.215112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407719.343054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407719.481170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407719.613060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407719.743315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407719.871228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407719.999364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407720.130758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407720.248574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407720.374352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407720.508297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407720.695582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407720.887903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407721.012758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407721.149624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407721.277666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407721.438369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407721.551028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407721.682208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407721.809311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407721.935350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407722.055005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407722.185797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407722.324815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407722.447140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407722.576686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407722.693851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407722.818882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407722.948660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407723.069726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407723.205754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407723.329770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407723.480076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407723.611218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407723.742641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407723.872659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407723.995183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407724.118125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407724.258797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407724.373474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407724.534935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407724.623999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407724.748960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407724.877995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407725.005777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407725.134270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407725.268318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407725.397464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407725.538337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407725.657957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407725.804319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407725.945916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407726.079483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407726.200765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407726.328594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407726.448163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407726.580528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407726.714557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407726.844886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407726.970018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407727.097526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407727.237466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407727.373541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407727.489728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407727.619564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407727.742173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407727.864732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407727.992564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407728.127232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407728.239738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407728.373196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407728.497827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407728.626649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407728.752208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407728.885665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407729.018261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407729.150914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407729.273233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407729.408200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407729.537303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407729.661613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407729.789372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407729.924477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407730.052187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407730.188889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407730.307880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407730.453543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407730.580606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407730.694704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407730.832055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407730.951588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407731.074898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407731.211909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407731.351296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407731.487877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407731.620146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407731.753046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407731.878637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407732.020310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407732.128503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407732.268171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407732.374201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407732.500399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407732.649104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407732.768777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407732.893558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407733.035661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407733.146511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407733.291515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407733.433483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407733.577127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407733.685349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407733.818409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407733.931159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407734.079841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407734.192114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407734.315840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407734.443751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407734.572602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407734.694038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407734.823867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407734.956850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407735.098974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407735.227012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407735.361238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407735.484771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407735.620708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407735.751572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407735.881217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407736.035527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407736.145585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407736.290575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407736.419682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407736.547134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407736.689337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407736.819023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407736.938431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407737.058736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407737.188018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407737.315406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407737.447685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407737.586617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407737.707503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407737.846658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407737.981538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407738.111849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407738.250051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407738.380411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407738.505871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407738.616880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407738.768981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407738.876850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407739.010015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407739.144340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407739.266728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407739.395391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407739.520941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407739.674316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407739.816741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407739.927764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407740.070613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407740.185716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407740.317138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407740.431828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407740.560913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407740.679438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407740.814562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407740.933179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407741.065773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407741.191494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407741.316057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407741.453259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407741.571773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407741.728771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407741.858288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407741.977412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407742.096420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407742.236300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407742.371266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407742.495615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407742.627872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407742.772688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407742.881091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407743.006912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407743.136152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407743.269927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407743.385565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407743.508425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407743.643809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407743.766336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407743.916690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407744.025364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407744.182980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407744.305689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407744.439267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407744.559572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407744.693182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407744.823494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407744.959655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407745.195303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407745.368137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407745.572623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407745.725574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407745.872431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407746.016583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407746.194192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407746.354982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407746.513365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407746.640702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407746.772243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407746.935962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407747.117620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407747.245600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407747.393109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407747.541887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407747.708914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407747.854992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407748.012287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407748.164343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407748.314244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407748.454076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407748.609810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407748.743507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407748.885797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407749.104236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407749.290436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407749.519120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407749.669756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407749.819554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407750.001211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407750.171107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407750.356879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407750.516259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407750.635611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407750.770880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407750.891745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407751.027804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407751.174094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407751.308805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407751.426341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407751.552202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407751.677884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407751.809056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407751.927797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407752.056030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407752.186488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407752.329172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407752.432099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407752.563766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407752.694117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407752.812638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407752.939520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407753.072036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407753.220379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407753.326299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407753.461371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407753.581432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407753.711841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407753.854545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407753.978718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407754.110885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407754.248379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407754.367270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407754.496194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407754.627422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407754.750693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407754.895352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407755.010279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407755.136716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407755.269014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407755.410810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407755.537347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407755.669744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407755.801666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407755.944108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407756.065040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407756.210996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407756.329569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407756.457649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407756.585164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407756.725242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407756.861138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407756.991604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407757.121175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407757.244388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407757.371781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407757.504426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407757.625639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407757.762019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407757.873223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407758.004097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407758.132718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407758.254655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407758.391224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407758.507997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407758.631518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407758.769677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407758.901480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407759.053968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407759.164036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407759.311570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407759.429585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407759.564874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407759.686453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407759.814567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407759.933908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407760.064576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407760.196239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407760.329749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407760.456550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407760.582509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407760.708731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407760.849892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407760.979237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407761.114528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407761.243547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407761.371217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407761.511397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407761.640482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407761.752131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407761.901915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407762.018939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407762.146713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407762.279528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407762.446840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407762.560259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407762.707790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407762.831105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407762.948859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407763.072304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407763.225756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407763.353507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407763.476984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407763.630862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407763.731953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407763.869121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407764.005318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407764.126418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407764.256399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407764.396895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407764.518378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407764.627185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407764.763575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407764.886127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407765.036952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407765.146194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407765.280413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407765.417884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407765.546361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407765.673772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407765.809534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407765.935133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407766.058597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407766.188075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407766.317517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407766.443912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407766.576561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407766.705833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407766.839005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407766.977056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407767.107989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407767.229761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407767.370647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407767.484511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407767.633695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407767.764230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407767.894131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407768.015591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407768.135517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407768.261194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407768.403602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407768.530593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407768.665664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407768.794201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407768.952629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407769.061110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407769.193485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407769.325450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407769.440115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407769.562695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407769.688048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407769.812223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407769.938265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407770.063942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407770.188627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407770.319489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407770.455899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407770.589484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407770.717250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407770.856853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407771.012130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407771.126748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407771.256773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407771.383319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407771.513715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407771.657157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407771.796451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407771.930842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407772.056859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407772.184491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407772.315231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407772.452728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407772.585118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407772.705000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407772.844934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407772.983254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407773.116100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407773.247897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407773.376818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407773.519566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407773.634664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407773.754819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407773.908179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407774.034444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407774.181473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407774.300517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407774.426888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407774.562366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407774.685908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407774.820368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407774.937005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407775.057808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407775.187324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407775.307380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407775.450894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407775.572805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407775.702913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407775.817319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407775.957995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407776.066504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407776.201942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407776.330257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407776.456765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407776.599787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407776.730718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407776.860474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407777.015743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407777.120567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407777.255033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407777.380006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407777.509339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407777.631981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407777.774930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407777.885988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407778.024009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407778.162152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407778.275298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407778.419607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407778.556638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407778.671785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407778.810912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407778.937867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407779.063807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407779.192819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407779.309349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407779.427963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407779.561079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407779.696947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407779.838213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407779.958039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407780.095551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407780.202586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407780.352344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407780.485746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407780.613471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407780.742423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407780.889413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407781.008792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407781.136301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407781.267014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407781.382617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407781.507478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407781.663249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407781.765792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407781.906378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407782.039999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407782.183802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407782.305739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407782.438694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407782.559401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407782.704409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407782.816885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407782.957351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407783.066110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407783.194628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407783.319050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407783.448958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407783.578091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407783.709693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407783.843246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407783.964729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407784.105058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407784.242770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407784.362331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407784.487441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407784.619746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407784.751244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407784.871750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407785.005910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407785.141249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407785.257056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407785.373556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407785.505076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407785.631846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407785.765553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407785.875494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407786.000711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407786.131624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407786.259726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407786.383573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407786.518178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407786.650081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407786.802286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407786.916756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407787.060602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407787.192927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407787.319604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407787.439512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407787.570865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407787.691777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407787.837067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407787.954669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407788.085936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407788.223774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407788.362400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407788.491168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407788.615676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407788.734861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407788.861081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407788.996961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407789.137622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407789.259411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407789.390491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407789.520262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407789.665311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407789.782481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407789.914710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407790.021112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407790.163088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407790.289689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407790.418417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407790.549862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407790.691985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407790.810550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407790.935731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407791.054183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407791.206103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407791.314370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407791.440694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407791.568127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407791.709543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407791.817237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407791.956263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407792.082592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407792.221054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407792.337883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407792.478197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407792.607520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407792.742398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407792.887214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407793.003904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407793.131205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407793.265884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407793.389473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407793.524989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407793.663828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407793.790624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407793.932012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407794.063905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407794.186417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407794.328848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407794.442209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407794.572011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407794.694810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407794.832837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407794.955875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407795.098926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407795.211005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407795.345681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407795.478690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407795.614217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407795.734618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407795.871735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407795.992249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407796.124492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407796.252611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407796.379969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407796.500989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407796.636878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407796.746419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407796.891112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407797.031928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407797.140797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407797.268910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407797.397676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407797.535731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407797.663925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407797.801240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407797.952656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407798.080590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407798.220151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407798.331004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407798.478216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407798.619128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407798.741466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407798.864036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407799.027514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407799.145128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407799.289432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407799.415376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407799.553686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407799.707235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407799.820488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407799.957941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407800.085629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407800.205994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407800.331169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407800.459203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407800.601163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407800.733268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407800.859560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407800.991322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407801.123618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407801.240943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407801.376080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407801.507168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407801.645587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407801.767865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407801.907589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407802.035470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407802.167142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407802.308035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407802.432124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407802.549879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407802.678863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407802.801141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407802.930224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407803.056808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407803.193764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407803.329521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407803.458179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407803.566712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407803.701759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407803.828395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407803.975035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407804.089896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407804.232532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407804.359165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407804.496611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407804.621826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407804.746888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407804.868727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407804.992635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407805.114609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407805.237841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407805.381903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407805.499642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407805.617246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407805.751281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407805.874586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407806.004921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407806.126170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407806.253138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407806.379931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407806.499669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407806.636781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407806.749995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407806.876103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407807.008236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407807.133544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407807.284196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407807.396084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407807.532167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407807.666845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407807.818637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407807.935549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407808.058049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407808.188242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407808.318647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407808.439086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407808.578201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407808.698601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407808.824992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407808.948120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407809.072328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407809.203663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407809.340545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407809.477787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407809.622174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407809.744141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407809.878384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407810.001995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407810.138334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407810.268615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407810.411760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407810.538190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407810.668914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407810.805556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407810.932632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407811.061141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407811.199493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407811.314546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407811.447383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407811.571129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407811.695132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407811.826799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407811.974794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407812.101326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407812.222473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407812.343789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407812.487323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407812.609931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407812.741294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407812.864393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407812.993132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407813.116282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407813.248215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407813.373426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407813.500253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407813.624061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407813.753512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407813.889140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407814.008136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407814.129207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407814.253523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407814.380955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407814.514868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407814.640837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407814.770312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407814.897080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407815.032068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407815.170660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407815.301024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407815.428468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407815.557717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407815.695099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407815.831181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407815.955398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407816.102413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407816.223205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407816.352910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407816.482260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407816.618183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407816.745752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407816.871386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407817.005684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407817.125836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407817.245960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407817.381070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407817.495157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407817.623483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407817.752091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407817.880024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407818.004531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407818.153191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407818.283488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407818.401998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407818.540720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407818.673098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407818.795351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407818.932847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407819.053039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407819.181847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407819.307148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407819.436510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407819.568456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407819.709105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407819.813981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407819.947803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407820.076447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407820.206963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407820.330596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407820.473687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407820.612170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407820.736112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407820.862564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407820.988192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407821.139653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407821.252669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407821.382399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407821.517792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407821.641266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407821.775408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407821.899931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407822.044647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407822.171912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407822.309421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407822.440233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407822.622101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407822.817621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407822.995806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407823.188586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407823.364431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407823.501679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407823.631576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407823.758571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407823.891764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407824.011818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407824.143316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407824.286169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407824.439926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407824.595872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407824.764987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407824.907966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407825.025053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407825.181484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407825.293689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407825.425247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407825.547880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407825.673936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407825.809805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407825.934412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407826.062510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407826.179143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407826.313247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407826.450587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407826.581195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407826.690443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407826.805916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407826.936383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407827.059053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407827.187899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407827.309516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407827.437360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407827.568285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407827.687539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407827.836041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407827.957185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407828.083065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407828.204398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407828.328658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407828.461363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407828.603703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407828.735835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407828.866049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407829.010019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407829.129285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407829.261930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407829.380416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407829.515820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407829.649123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407829.785036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407829.920255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407830.048819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407830.183496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407830.310291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407830.433213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407830.573129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407830.686849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407830.811569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407830.940413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407831.065898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407831.190269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407831.316385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407831.461010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407831.588758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407831.739329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407831.867408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407831.996376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407832.120207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407832.249470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407832.372900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407832.502676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407832.623411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407832.752957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407832.879369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407833.016207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407833.141082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407833.290570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407833.423914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407833.549497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407833.688281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407833.813881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407833.939137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407834.061974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407834.194537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407834.318310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407834.460998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407834.571086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407834.693093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407834.825524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407834.951676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407835.081882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407835.218798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407835.331306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407835.473605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407835.596278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407835.716347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407835.852322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407835.991376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407836.122366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407836.247021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407836.392195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407836.636205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407836.800023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407836.978536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407837.134126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407837.318808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407837.479594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407837.682506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407837.850722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407837.997953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407838.123257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407838.248652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407838.383022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407838.503473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407838.633720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407838.756615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407838.877189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407839.003408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407839.128821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407839.247673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407839.381607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407839.512992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407839.643287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407839.786547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407839.916100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407840.043322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407840.186053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407840.308775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407840.445258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407840.558030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407840.683603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407840.814035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407840.956480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407841.197303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407841.315238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407841.440189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407841.559915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407841.683336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407841.819124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407841.942727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407842.066507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407842.188974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407842.326769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407842.453833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407842.586401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407842.718032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407842.841676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407842.979517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407843.079942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407843.217301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407843.350861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407843.483025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407843.618885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407843.742791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407843.870095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407844.000494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407844.124606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407844.250681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407844.373278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407844.498896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407844.627539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407844.748472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407844.890011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407845.002808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407845.124682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407845.252309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407845.371382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407845.497673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407845.624515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407845.755388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407845.884851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407846.021771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407846.141310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407846.298030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407846.426955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407846.555452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407846.678298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407846.799434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407846.930217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407847.057862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407847.182345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407847.312073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407847.432829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407847.567163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407847.691225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407847.817447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407847.961022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407848.070680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407848.193521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407848.331542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407848.458654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407848.594231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407848.727913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407848.865320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407848.991467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407849.122469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407849.245244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407849.371441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407849.496769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407849.619772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407849.741798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407849.875315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407849.999606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407850.127746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407850.249174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407850.376763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407850.502187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407850.631266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407850.767574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407850.909514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407851.039559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407851.149122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407851.286862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407851.415506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407851.546581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407851.674214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407851.796690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407851.938236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407852.070491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407852.197073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407852.320734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407852.462072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407852.570441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407852.707153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407852.833123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407852.981541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407853.102254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407853.229351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407853.392045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407853.513776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407853.629664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407853.752058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407853.897065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407854.020539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407854.144649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407854.280055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407854.409075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407854.541066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407854.674865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407854.803807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407854.932893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407855.065173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407855.185554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407855.317769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407855.439573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407855.563749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407855.690163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407855.827199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407855.933716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407856.063812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407856.181911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407856.305965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407856.438817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407856.560210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407856.678978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407856.825578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407856.936683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407857.070482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407857.190993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407857.319173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407857.443302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407857.566327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407857.690058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407857.818241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407857.953033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407858.075619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407858.215390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407858.347281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407858.498598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407858.618309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407858.744099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407858.875538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407859.000367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407859.129291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407859.251794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407859.378982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407859.498774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407859.632824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407859.758292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407859.890672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407860.018315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407860.143070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407860.274996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407860.400765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407860.535978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407860.672771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407860.788988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407860.918206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407861.057157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407861.173834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407861.308555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407861.428388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407861.547181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407861.725921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407861.837638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407861.969795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407862.110650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407862.234110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407862.373961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407862.499893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407862.631613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407862.768827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407862.908525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407863.017921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407863.148428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407863.287684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407863.428694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407863.562979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407863.702163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407863.820492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407863.939383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407864.075081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407864.194122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407864.328882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407864.455973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407864.578296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407864.721117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407864.850390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407864.971193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407865.115484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407865.234691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407865.373792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407865.494231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407865.624570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407865.741718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407865.871135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407865.990563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407866.121343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407866.242129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407866.372096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407866.493112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407866.618544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407866.744287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407866.869360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407866.998869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407867.136673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407867.246760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407867.382573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407867.492067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407867.625109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407867.752419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407867.883407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407868.010239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407868.133704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407868.263142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407868.389786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407868.517002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407868.644481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407868.788390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407868.928313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407869.046061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407869.176760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407869.301589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407869.452013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407869.569366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407869.694410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407869.808958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407869.925598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407870.061189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407870.204167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407870.313192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407870.437024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407870.558161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407870.686956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407870.810016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407870.949677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407871.058089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407871.191502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407871.325147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407871.438676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407871.563190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407871.685235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407871.808255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407871.938069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407872.079312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407872.191164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407872.311236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407872.433748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407872.567945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407872.705081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407872.830201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407872.947797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407873.071954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407873.197852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407873.344501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407873.450725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407873.581187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407873.710792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407873.847322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407873.973351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407874.105103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407874.226759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407874.353782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407874.480351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407874.612627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407874.736028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407874.869759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407874.996792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407875.124149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407875.244275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407875.375072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407875.511928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407875.628386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407875.749680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407875.881918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407876.018057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407876.143127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407876.270787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407876.407507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407876.539806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407876.665482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407876.802541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407876.923361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407877.051473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407877.177320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407877.299112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407877.429651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407877.556374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407877.678534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407877.811033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407877.937638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407878.069713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407878.195804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407878.324183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407878.443711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407878.580252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407878.707761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407878.856936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407878.976715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407879.110972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407879.231855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407879.356124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407879.487075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407879.622573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407879.745792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407879.870794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407879.990551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407880.130077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407880.256783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407880.393591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407880.511806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407880.641723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407880.777849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407880.924249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407881.048041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407881.175130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407881.303054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407881.439929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407881.558263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407881.678126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407881.802238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407881.951876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407882.064901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407882.194845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407882.319705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407882.446208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407882.577295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407882.719951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407882.830728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407882.970293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407883.108218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407883.246870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407883.366307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407883.496382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407883.623562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407883.754536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407883.877715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407884.005520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407884.133766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407884.262353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407884.388819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407884.523597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407884.658172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407884.787747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407884.912930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407885.059608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407885.180131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407885.315584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407885.430134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407885.562310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407885.685823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407885.809696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407885.944214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407886.080372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407886.234614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407886.488954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407886.643304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407886.799699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407886.929619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407887.048906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407887.169524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407887.298835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407887.424417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407887.555472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407887.693812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407887.806458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407887.930757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407888.060550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407888.186181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407888.325475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407888.442810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407888.567244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407888.698108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407888.810774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407888.935964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407889.070507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407889.202226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407889.309952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407889.451100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407889.561607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407889.680785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407889.812349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407889.927191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407890.060761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407890.184438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407890.307909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407890.430354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407890.566849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407890.686020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407890.814839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407890.934223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407891.069070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407891.193287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407891.324109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407891.453853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407891.587024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407891.739918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407891.872087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407891.998722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407892.123277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407892.250807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407892.390002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407892.531492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407892.663461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407892.790679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407892.915641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407893.054097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407893.183131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407893.306298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407893.448372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407893.554361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407893.687969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407893.808685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407893.940505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407894.081049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407894.223729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407894.329085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407894.453597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407894.594471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407894.724224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407894.852739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407894.977738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407895.106423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407895.236492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407895.362308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407895.492696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407895.617304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407895.748022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407895.876906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407896.007973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407896.125953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407896.251298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407896.379966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407896.510795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407896.632324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407896.766226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407896.893795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407897.041270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407897.165524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407897.297491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407897.421723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407897.548896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407897.680200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407897.811190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407897.931634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407898.059335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407898.175863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407898.300913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407898.424931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407898.555674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407898.681419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407898.814371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407898.936855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407899.071340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407899.190113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407899.315494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407899.458792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407899.597504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407899.708129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407899.849679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407899.978109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407900.113496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407900.238084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407900.363302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407900.488319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407900.622108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407900.741989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407900.870818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407900.998259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407901.125276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407901.259273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407901.378741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407901.513796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407901.628094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407901.754548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407901.878963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407902.004439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407902.144475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407902.263393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407902.395225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407902.518160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407902.659164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407902.788140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407902.921084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407903.047735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407903.183132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407903.314028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407903.440031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407903.575994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407903.686829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407903.807031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407903.958680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407904.077301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407904.194949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407904.326439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407904.458715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407904.582305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407904.721233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407904.847044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407904.972366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407905.100509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407905.238269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407905.360619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407905.484811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407905.616578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407905.757956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407905.869057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407906.007935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407906.125602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407906.256424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407906.378628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407906.505898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407906.629652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407906.759078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407906.884243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407907.028581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407907.154130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407907.289507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407907.415079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407907.541305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407907.672476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407907.803794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407907.934450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407908.068430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407908.201007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407908.336145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407908.454187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407908.591464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407908.707599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407908.827811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407908.967947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407909.097564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407909.227712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407909.367209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407909.482700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407909.609861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407909.748294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407909.873048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407909.988967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407910.126790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407910.254374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407910.375269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407910.499598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407910.641808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407910.742441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407910.869907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407911.004212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407911.139134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407911.265518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407911.406681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407911.537040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407911.680449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407911.797585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407911.934185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407912.061919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407912.185901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407912.309539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407912.438391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407912.562604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407912.688617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407912.814181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407912.946233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407913.079457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407913.220458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407913.341564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407913.476691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407913.605147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407913.737501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407913.864708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407913.993837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407914.121893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407914.249918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407914.371538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407914.501121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407914.628426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407914.754697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407914.888356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407915.015897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407915.134990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407915.265031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407915.402050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407915.529928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407915.671607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407915.804708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407915.917103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407916.049198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407916.170801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407916.310080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407916.433234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407916.561792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407916.687435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407916.819114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407916.934160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407917.064157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407917.187685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407917.312141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407917.431792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407917.559142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407917.685720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407917.815143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407917.949674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407918.087439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407918.217703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407918.346557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407918.487324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407918.618880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407918.732510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407918.877690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407918.993689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407919.125936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407919.249144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407919.371588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407919.502152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407919.625058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407919.753060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407919.888065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407920.011933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407920.147401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407920.266316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407920.418728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407920.555072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407920.679493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407920.798525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407920.937200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407921.059241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407921.188285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407921.309090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407921.430584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407921.576011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407921.725759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407921.831509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407921.977298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407922.116266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407922.243700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407922.371386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407922.505694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407922.629158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407922.771017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407922.886971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407923.018505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407923.144277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407923.277323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407923.407982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407923.546883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407923.670180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407923.811930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407923.924906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407924.062434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407924.181056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407924.309907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407924.426481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407924.556427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407924.676589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407924.808695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407924.936496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407925.056134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407925.180208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407925.306017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407925.431694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407925.555762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407925.677931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407925.806216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407925.928481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407926.054306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407926.182192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407926.311983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407926.431808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407926.566046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407926.690065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407926.817875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407926.954299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407927.103697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407927.223450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407927.366445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407927.483264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407927.630467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407927.745455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407927.873836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407927.993546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407928.124970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407928.243329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407928.372238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407928.497333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407928.624421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407928.753094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407928.875757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407928.991825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407929.123388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407929.241847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407929.370743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407929.495343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407929.617883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407929.755531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407929.879258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407930.000845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407930.134892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407930.272798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407930.390185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407930.515365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407930.645944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407930.772511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407930.912760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407931.039434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407931.170149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407931.299468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407931.423817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407931.545852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407931.665671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407931.801535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407931.933897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407932.048053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407932.183590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407932.308379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407932.435158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407932.553951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407932.682324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407932.811755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407932.935515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407933.082606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407933.186799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407933.313201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407933.440343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407933.565900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407933.699757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407933.826048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407933.955706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407934.077919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407934.221319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407934.335942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407934.484950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407934.611699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407934.737440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407934.859520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407934.999989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407935.121658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407935.245031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407935.370053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407935.497095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407935.626646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407935.755150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407935.881294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407936.017331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407936.138628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407936.283571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407936.413635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407936.537575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407936.670085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407936.809150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407936.937092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407937.074525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407937.190665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407937.327368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407937.451555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407937.612447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407937.724931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407937.852070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407937.985027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407938.112613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407938.234073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407938.366935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407938.482464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407938.630033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407938.728932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407938.862183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407938.986774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407939.118598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407939.244802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407939.375840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407939.491593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407939.619081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407939.744087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407939.871355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407940.000866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407940.122208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407940.245784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407940.372432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407940.495848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407940.638299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407940.744770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407940.875144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407941.002165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407941.122482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407941.244648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407941.372511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407941.495015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407941.626882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407941.763300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407941.888210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407942.019051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407942.148380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407942.281836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407942.430722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407942.560502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407942.679066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407942.798657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407942.935743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407943.050731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407943.183426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407943.303648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407943.432225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407943.554977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407943.681655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407943.808057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407943.927871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407944.066561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407944.188077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407944.304539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407944.438799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407944.560716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407944.681278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407944.803216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407944.929443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407945.063316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407945.188935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407945.306296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407945.455721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407945.566168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407945.693874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407945.813677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407945.937720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407946.064162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407946.207295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407946.330634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407946.492507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407946.598068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407946.730171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407946.851135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407946.973944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407947.105915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407947.233050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407947.358251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407947.488454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407947.607549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407947.735633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407947.869743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407948.006542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407948.120618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407948.252592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407948.375638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407948.509897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407948.646691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407948.785669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407948.915417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407949.031903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407949.175269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407949.302568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407949.435070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407949.561291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407949.689259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407949.807205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407949.931391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407950.059207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407950.185878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407950.324711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407950.448741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407950.586485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407950.720202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407950.844040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407950.973979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407951.123541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407951.234581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407951.369733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407951.495425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407951.625892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407951.753191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407951.886922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407952.019119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407952.152129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407952.282543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407952.406618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407952.547004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407952.669919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407952.807976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407952.930849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407953.044029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407953.168966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407953.290666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407953.423061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407953.563758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407953.676381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407953.791242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407953.946782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407954.047750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407954.171162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407954.308952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407954.431066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407954.552567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407954.680913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407954.803290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407954.931618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407955.046200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407955.176975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407955.297052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407955.423352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407955.548125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407955.674334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407955.800808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407955.937871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407956.053099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407956.185513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407956.314798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407956.436317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407956.558563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407956.683552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407956.807330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407956.931024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407957.074479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407957.189794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407957.453974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407957.655037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407957.804635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407957.972965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407958.144687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407958.324167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407958.503468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407958.674011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407958.856385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407958.980428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407959.118738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407959.238741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407959.357891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407959.484367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407959.615182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407959.755691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407959.872547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407959.992524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407960.119809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407960.252203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407960.372203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407960.494577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407960.622650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407960.761456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407960.871217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407960.997028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407961.121190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407961.251459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407961.369675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407961.492584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407961.621864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407961.751432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407961.934811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407962.119942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407962.249187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407962.370937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407962.520007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407962.623879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407962.769467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407962.898532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407963.023229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407963.163832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407963.305156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407963.434717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407963.571914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407963.677133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407963.809905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407963.933295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407964.057278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407964.178324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407964.305577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407964.431258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407964.571931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407964.680664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407964.804501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407964.927705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407965.059062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407965.180681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407965.309625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407965.431124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407965.561828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407965.679820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407965.810313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407965.931329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407966.070943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407966.183678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407966.305069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407966.439919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407966.567168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407966.697712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407966.827535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407966.947084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407967.106595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407967.245731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407967.364897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407967.491848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407967.633564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407967.743021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407967.871204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407967.993929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407968.122154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407968.248149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407968.371562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407968.495883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407968.622849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407968.747133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407968.889589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407969.002456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407969.136082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407969.262047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407969.406552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407969.546142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407969.675952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407969.800755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407969.934688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407970.072673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407970.176390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407970.304534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407970.433473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407970.565006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407970.678936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407970.805142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407970.927900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407971.059598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407971.205214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407971.306980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407971.436247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407971.560151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407971.699347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407971.814216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407971.951903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407972.074714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407972.219078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407972.325691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407972.468524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407972.596368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407972.727706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407972.860500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407973.011323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407973.115240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407973.247997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407973.374583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407973.503281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407973.625727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407973.751581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407973.878533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407974.013529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407974.137001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407974.264536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407974.405640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407974.533990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407974.662840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407974.786870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407974.910455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407975.058661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407975.177537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407975.304839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407975.428619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407975.554126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407975.683411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407975.807490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407975.933554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407976.058177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407976.182678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407976.307705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407976.429969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407976.574303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407976.696019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407976.833915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407976.956567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407977.080994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407977.199399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407977.335487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407977.472448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407977.601252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407977.730128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407977.865700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407978.002632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407978.126206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407978.244975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407978.371949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407978.492077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407978.622951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407978.741509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407978.877711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407978.995857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407979.119681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407979.247784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407979.384587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407979.504927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407979.640838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407979.780246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407979.912653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407980.048074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407980.177074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407980.326106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407980.458523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407980.583069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407980.725624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407980.852975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407980.978131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407981.110216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407981.235636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407981.360882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407981.491584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407981.627507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407981.760550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407981.879312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407982.018331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407982.159623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407982.291039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407982.418233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407982.549966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407982.670783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407982.805043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407982.924967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407983.058806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407983.183795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407983.308155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407983.430734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407983.557091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407983.688899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407983.813819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407983.938491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407984.072253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407984.198898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407984.334080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407984.464250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407984.596992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407984.738727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407984.879882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407984.990315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407985.110366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407985.239698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407985.366803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407985.495777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407985.619042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407985.746534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407985.873523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407986.003139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407986.125055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407986.246352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407986.375544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407986.502744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407986.626559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407986.749978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407986.878362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407986.999810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407987.128494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407987.252151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407987.388338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407987.517993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407987.661036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407987.791860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407987.923272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407988.042966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407988.172649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407988.308080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407988.430805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407988.555929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407988.677367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407988.807701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407988.934091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407989.057979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407989.180764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407989.311168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407989.427103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407989.553014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407989.681116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407989.818615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407989.935065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407990.056586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407990.190795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407990.310552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407990.441981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407990.577123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407990.699202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407990.831227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407990.987035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407991.104739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407991.230139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407991.355726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407991.485575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407991.604891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407991.738088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407991.863752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407991.991418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407992.115695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407992.250156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407992.370514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407992.493588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407992.642174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407992.751394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407992.886022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407993.005270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407993.131648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407993.254761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407993.387411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407993.516638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407993.646968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407993.787313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407993.920441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407994.056485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407994.179609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407994.300022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407994.425149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407994.554687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407994.673002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407994.805234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407994.930027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407995.053974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407995.191814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407995.300160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407995.423421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407995.555346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407995.675159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407995.824055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407995.927869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407996.051004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407996.181144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407996.325858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407996.432325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407996.576162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407996.690905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407996.824629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407996.941944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407997.070910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407997.198640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407997.344393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407997.460935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407997.602390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407997.727447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407997.855815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407997.986222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407998.111907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407998.235411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407998.363393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407998.490258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407998.619561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407998.737926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407998.867488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407999.004432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407999.117863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407999.262045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407999.380171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407999.503919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407999.640352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407999.766967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407999.892193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408000.029531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408000.169039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408000.299529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408000.450043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408000.552363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408000.685609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408000.809299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408000.937942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408001.057438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408001.186476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408001.307204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408001.431302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408001.556204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408001.687299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408001.801685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408001.931029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408002.051531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408002.187363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408002.313352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408002.442481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408002.570289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408002.718835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408002.869259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408003.029305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408003.170413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408003.288348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408003.419901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408003.562934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408003.665168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408003.805981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408003.923575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408004.050604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408004.178452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408004.310143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408004.436080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408004.564214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408004.686188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408004.822203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408004.942572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408005.075138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408005.200807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408005.348272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408005.476388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408005.605161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408005.734524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408005.861279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408005.991590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408006.125856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408006.231635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408006.370549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408006.488942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408006.616533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408006.743720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408006.872741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408006.996887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408007.119187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408007.243256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408007.371903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408007.501333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408007.634085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408007.750173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408007.882617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408008.030817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408008.155113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408008.285446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408008.423532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408008.542765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408008.673772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408008.798844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408008.919937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408009.049181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408009.175278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408009.299379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408009.445931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408009.560402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408009.684480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408009.804917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408009.931922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408010.069539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408010.181082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408010.298604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408010.429098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408010.553005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408010.690274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408010.806454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408010.939107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408011.071703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408011.199087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408011.328149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408011.466878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408011.598297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408011.741841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408011.874323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408011.999059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408012.121557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408012.249593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408012.370628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408012.500297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408012.634112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408012.758064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408012.881448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408013.023232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408013.142879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408013.307655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408013.427671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408013.558267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408013.704331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408013.812941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408013.936407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408014.064509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408014.201301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408014.330882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408014.461978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408014.595847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408014.735614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408014.863241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408014.985725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408015.118819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408015.239513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408015.370696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408015.492348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408015.621362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408015.744587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408015.867837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408015.994171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408016.118798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408016.244883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408016.371653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408016.495496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408016.620053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408016.740654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408016.866855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408017.008579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408017.120498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408017.248603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408017.382064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408017.502116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408017.634623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408017.775623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408017.909044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408018.035172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408018.164185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408018.286264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408018.422063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408018.545217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408018.682258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408018.802813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408018.929960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408019.049182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408019.179559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408019.304801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408019.433215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408019.554205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408019.682024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408019.806621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408019.945687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408020.078990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408020.212184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408020.357943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408020.490521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408020.604531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408020.738963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408020.860332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408020.997504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408021.126594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408021.242444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408021.369719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408021.510581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408021.621484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408021.749983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408021.877240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408022.033650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408022.141066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408022.277911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408022.408135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408022.535831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408022.672030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408022.805298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408022.919370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408023.056888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408023.176981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408023.306933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408023.422766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408023.559067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408023.676310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408023.816844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408023.926259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408024.060509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408024.178999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408024.304875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408024.432592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408024.559202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408024.683040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408024.812666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408024.936115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408025.065661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408025.196249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408025.342304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408025.471021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408025.615407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408025.728105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408025.861138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408025.975602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408026.106922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408026.232061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408026.366589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408026.492467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408026.618864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408026.758398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408026.868375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408026.992934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408027.136022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408027.243868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408027.371087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408027.494413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408027.623608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408027.747607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408027.887528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408028.008680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408028.142073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408028.278645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408028.408492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408028.530842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408028.680152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408028.799429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408028.921899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408029.052977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408029.177145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408029.294242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408029.427294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408029.540502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408029.685200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408029.790035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408029.924594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408030.052416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408030.178384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408030.296138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408030.439569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408030.546322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408030.688832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408030.794505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408030.936595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408031.052511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408031.174030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408031.303717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408031.431988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408031.555696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408031.699520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408031.807965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408031.940061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408032.064259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408032.190382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408032.316703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408032.444628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408032.568558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408032.710932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408032.842668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408032.989253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408033.109220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408033.240539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408033.357057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408033.489102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408033.619042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408033.746168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408033.864197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408033.994279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408034.116754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408034.237700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408034.370066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408034.496942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408034.610486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408034.738182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408034.868917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408035.008013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408035.120599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408035.248180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408035.372192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408035.501098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408035.626711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408035.758174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408035.886617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408036.023127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408036.146481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408036.280855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408036.412307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408036.546622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408036.668168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408036.796378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408036.919283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408037.057634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408037.172523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408037.300542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408037.438637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408037.558437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408037.669318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408037.807816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408037.925188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408038.074304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408038.198989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408038.316426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408038.439297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408038.572466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408038.705542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408038.841282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408038.959743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408039.114823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408039.233889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408039.361741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408039.482924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408039.622159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408039.754594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408039.883380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408040.002949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408040.138067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408040.263450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408040.403772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408040.541303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408040.683941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408040.792044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408040.932598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408041.065199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408041.194081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408041.309287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408041.444539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408041.563350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408041.717782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408041.851356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408041.988549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408042.115443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408042.249893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408042.370464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408042.514641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408042.613675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408042.736303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408042.867780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408043.001568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408043.122769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408043.253566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408043.383166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408043.529665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408043.674931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408043.820602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408043.926362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408044.046696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408044.183968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408044.302924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408044.427066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408044.557266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408044.681550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408044.810050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408044.935073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408045.060732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408045.185482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408045.314792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408045.465692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408045.583325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408045.716867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408045.832488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408045.973634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408046.105996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408046.223930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408046.365171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408046.490249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408046.616106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408046.734845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408046.861196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408046.984183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408047.118981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408047.244849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408047.372895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408047.497611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408047.628843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408047.763141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408047.885609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408048.010916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408048.151417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408048.278447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408048.420585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408048.540963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408048.673017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408048.794236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408048.929170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408049.057992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408049.184603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408049.307509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408049.435195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408049.560780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408049.692737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408049.821458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408049.962796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408050.088720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408050.218668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408050.368196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408050.486858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408050.615276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408050.755292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408050.877051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408051.008324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408051.137200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408051.266266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408051.390352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408051.559961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408051.676948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408051.803751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408051.928511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408052.068059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408052.179155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408052.312503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408052.431583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408052.556347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408052.685978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408052.808335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408052.928701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408053.058660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408053.183187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408053.313155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408053.436835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408053.573604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408053.695659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408053.822090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408053.959419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408054.090560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408054.224968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408054.356926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408054.478930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408054.596645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408054.729365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408054.859648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408054.988435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408055.132851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408055.245684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408055.373365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408055.500919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408055.654801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408055.780579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408055.923341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408056.045181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408056.170513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408056.299502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408056.436605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408056.550608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408056.676596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408056.803456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408056.931895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408057.069997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408057.184518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408057.310682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408057.445850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408057.597752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408057.730627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408057.857138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408057.985236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408058.110193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408058.240955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408058.355674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408058.489259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408058.608420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408058.735614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408058.869313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408058.994769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408059.117259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408059.252471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408059.372365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408059.510328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408059.624453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408059.750694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408059.872053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408060.005929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408060.125731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408060.253006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408060.385092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408060.511319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408060.641581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408060.759086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408060.919382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408061.035495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408061.159454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408061.284795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408061.423996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408061.545624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408061.673513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408061.800186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408061.929813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408062.056587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408062.173629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408062.304307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408062.428903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408062.557898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408062.684927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408062.826323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408062.954847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408063.079718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408063.215474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408063.359456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408063.471964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408063.608000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408063.727724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408063.880573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408063.990314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408064.115584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408064.238158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408064.370965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408064.492705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408064.616567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408064.737950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408064.866996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408064.988817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408065.114180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408065.239295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408065.368702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408065.484060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408065.635950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408065.732290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408065.874844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408066.007825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408066.132947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408066.235489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408066.375962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408066.502424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408066.626505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408066.745898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408066.877959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408067.012957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408067.158003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408067.281435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408067.424204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408067.544793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408067.680223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408067.797366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408067.931044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408068.057810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408068.184515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408068.320797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408068.439831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408068.569517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408068.695023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408068.824518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408068.937548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408069.087324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408069.203697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408069.342389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408069.471102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408069.598600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408069.724782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408069.858211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408069.990128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408070.117321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408070.241087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408070.366182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408070.487376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408070.612208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408070.737278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408070.855746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408070.996162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408071.116191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408071.241755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408071.368913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408071.499081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408071.629449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408071.761627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408071.896282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408072.034033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408072.159880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408072.291138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408072.417156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408072.543682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408072.675097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408072.805010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408072.927570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408073.054659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408073.177925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408073.317787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408073.429840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408073.564141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408073.687227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408073.819856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408073.948355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408074.078338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408074.218482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408074.365993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408074.482402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408074.618197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408074.740368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408074.871778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408075.004740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408075.146519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408075.258935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408075.387257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408075.517126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408075.654187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408075.785863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408075.910691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408076.041099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408076.179952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408076.292765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408076.424762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408076.553150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408076.689997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408076.804423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408076.928850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408077.051906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408077.182091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408077.305370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408077.431311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408077.547866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408077.693764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408077.817212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408077.953067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408078.274268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408078.417456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408078.618728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408078.753734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408078.917910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408079.069795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408079.264071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408079.431500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408079.591976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408079.752160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408079.934894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408080.051630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408080.180383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408080.304134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408080.436512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408080.551240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408080.677160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408080.802109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408080.929867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408081.055121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408081.183411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408081.303446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408081.426298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408081.547448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408081.676617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408081.813338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408081.927308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408082.043229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408082.181932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408082.301886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408082.426579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408082.557315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408082.683568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408082.809687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408083.062278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408083.183990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408083.312843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408083.436790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408083.569204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408083.700833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408083.855866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408083.968280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408084.098857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408084.223682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408084.350928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408084.472139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408084.602940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408084.731211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408084.865141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408084.990371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408085.112909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408085.248187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408085.376368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408085.484449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408085.615409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408085.736490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408085.869727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408086.004819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408086.115393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408086.256446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408086.366001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408086.486085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408086.619368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408086.734095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408086.881954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408086.996072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408087.135866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408087.249767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408087.377314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408087.507384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408087.634879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408087.772848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408087.920155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408088.035686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408088.177656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408088.302768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408088.428653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408088.551709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408088.676446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408088.805092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408088.933866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408089.054212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408089.191647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408089.309603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408089.438731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408089.570690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408089.690174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408089.821713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408089.945963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408090.085351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408090.230163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408090.352618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408090.477562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408090.598405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408090.737833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408090.856474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408090.988001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408091.112083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408091.237740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408091.361303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408091.491279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408091.611538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408091.741659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408091.864918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408091.993576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408092.117764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408092.244177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408092.371846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408092.528296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408092.634358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408092.756688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408092.907362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408093.019965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408093.153819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408093.286484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408093.406598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408093.549654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408093.677158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408093.798542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408093.924463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408094.047779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408094.175554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408094.302068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408094.424464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408094.555068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408094.675405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408094.802568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408094.922534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408095.072668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408095.180305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408095.308770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408095.439654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408095.569223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408095.684405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408095.817124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408095.938127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408096.066741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408096.192806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408096.326655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408096.462100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408096.589649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408096.721240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408096.852674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408096.981697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408097.114995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408097.241825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408097.368234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408097.491812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408097.615669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408097.741347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408097.873785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408097.999712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408098.129645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408098.261981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408098.400143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408098.527498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408098.666938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408098.801762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408098.919974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408099.037573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408099.167597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408099.300261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408099.427318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408099.567813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408099.684296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408099.809186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408099.934256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408100.061356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408100.195304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408100.320854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408100.464672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408100.594110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408100.723294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408100.850223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408100.973535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408101.106825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408101.235809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408101.361098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408101.488172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408101.648351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408101.756417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408101.882147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408102.008185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408102.147083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408102.275614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408102.407267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408102.537583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408102.660506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408102.791052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408102.920810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408103.052350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408103.172897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408103.307814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408103.427741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408103.555789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408103.683087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408103.814718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408103.940667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408104.068434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408104.192524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408104.320368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408104.446413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408104.572493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408104.701175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408104.827002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408104.965089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408105.096982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408105.235705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408105.363070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408105.503763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408105.623352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408105.738351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408105.880792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408105.989995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408106.111076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408106.251322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408106.361042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408106.484955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408106.611392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408106.736403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408106.863006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408106.986628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408107.118897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408107.235192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408107.364161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408107.488556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408107.622072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408107.745846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408107.890811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408108.008057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408108.139985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408108.268781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408108.407288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408108.518364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408108.661096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408108.781967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408108.922050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408109.039347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408109.163235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408109.293640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408109.426946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408109.550273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408109.677584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408109.803627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408109.931336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408110.047462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408110.176895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408110.300050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408110.429686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408110.556242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408110.691277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408110.811257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408110.944390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408111.068986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408111.205330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408111.341024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408111.474266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408111.611181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408111.746027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408111.861867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408111.992318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408112.132311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408112.247777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408112.364099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408112.492967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408112.613565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408112.736624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408112.862968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408112.981740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408113.106609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408113.256340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408113.366491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408113.495885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408113.619190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408113.745362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408113.871740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408114.003813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408114.129094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408114.256734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408114.379757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408114.507236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408114.640182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408114.776389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408114.918074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408115.037239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408115.174566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408115.297142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408115.423272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408115.549866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408115.687492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408115.811827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408115.951916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408116.083247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408116.219429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408116.353158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408116.480305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408116.630862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408116.748798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408116.871426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408116.993527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408117.135451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408117.246966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408117.379846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408117.500273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408117.645232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408117.762419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408117.887186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408118.024099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408118.163099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408118.293305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408118.408535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408118.540790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408118.666527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408118.797336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408118.921372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408119.047475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408119.175811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408119.299268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408119.446030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408119.552653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408119.673739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408119.817266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408119.924729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408120.069492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408120.183521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408120.312905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408120.446677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408120.569997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408120.702192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408120.846910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408120.980937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408121.109635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408121.256085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408121.362499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408121.494812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408121.611979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408121.740039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408121.868561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408121.990732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408122.119104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408122.245513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408122.372354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408122.498213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408122.632847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408122.745830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408122.872017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408123.008051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408123.138243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408123.277920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408123.408424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408123.544868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408123.690494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408123.796632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408123.923886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408124.053830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408124.174570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408124.319737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408124.423234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408124.542981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408124.672578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408124.803985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408124.942539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408125.051386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408125.184242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408125.307637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408125.444753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408125.583915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408125.716480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408125.841188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408125.967021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408126.095920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408126.231735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408126.365554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408126.478364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408126.615772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408126.729704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408126.861550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408126.974662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408127.107804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408127.229197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408127.365170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408127.484761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408127.613528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408127.734200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408127.866516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408127.988620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408128.120915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408128.243568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408128.388597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408128.497550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408128.617701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408128.748193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408128.863166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408128.985338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408129.116737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408129.227846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408129.359464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408129.488564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408129.618172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408129.725554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408129.850556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408129.986574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408130.131590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408130.237928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408130.371024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408130.488465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408130.623229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408130.745267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408130.874240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408130.995788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408131.136443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408131.258662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408131.412042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408131.529759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408131.656176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408131.800974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408131.930226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408132.070219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408132.194552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408132.318020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408132.459117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408132.575341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408132.719052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408132.853502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408132.981760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408133.099676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408133.227349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408133.347673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408133.495017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408133.604685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408133.738041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408133.862869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408133.990923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408134.114545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408134.243760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408134.394219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408134.498716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408134.627625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408134.757552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408134.901655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408135.029689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408135.163443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408135.290668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408135.416439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408135.541671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408135.661004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408135.784759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408135.923889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408136.052102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408136.181296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408136.309605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408136.433998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408136.573768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408136.709960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408136.844370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408136.967748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408137.081837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408137.225559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408137.356438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408137.484963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408137.609122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408137.735238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408137.859897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408137.984245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408138.106323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408138.236357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408138.360434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408138.483905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408138.613484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408138.740086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408138.867003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408138.999630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408139.118334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408139.242538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408139.378122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408139.494438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408139.622756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408139.740050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408139.875910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408139.998210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408140.129863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408140.255741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408140.386767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408140.507078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408140.645352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408140.764929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408140.907931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408141.049562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408141.164039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408141.294841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408141.419175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408141.553111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408141.673082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408141.801469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408141.925470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408142.045488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408142.179635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408142.297770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408142.424525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408142.557979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408142.701569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408142.834872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408142.951042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408143.093369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408143.225901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408143.355089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408143.480110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408143.607075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408143.734467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408143.867423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408143.988887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408144.109718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408144.234939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408144.357419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408144.495759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408144.619622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408144.757765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408144.871257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408144.996150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408145.120880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408145.246923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408145.369217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408145.498068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408145.622208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408145.753847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408145.888172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408146.010242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408146.134932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408146.281118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408146.410738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408146.546746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408146.668871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408146.793997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408146.917167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408147.048043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408147.164931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408147.293713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408147.420198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408147.547998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408147.673869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408147.793494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408147.923099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408148.051278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408148.171760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408148.316426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408148.429440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408148.559119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408148.682303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408148.812435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408148.944408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408149.082912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408149.219872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408149.343910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408149.474631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408149.611552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408149.735043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408149.852367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408149.976197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408150.109277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408150.232860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408150.361054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408150.486260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408150.618828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408150.739240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408150.863946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408150.986457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408151.120159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408151.243173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408151.375153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408151.509063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408151.651635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408151.793823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408151.917808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408152.054745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408152.176664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408152.304400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408152.424487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408152.557782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408152.691592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408152.813069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408152.945694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408153.072333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408153.211840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408153.340862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408153.475483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408153.611522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408153.751124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408153.863436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408153.981709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408154.110581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408154.241336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408154.368396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408154.497627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408154.637681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408154.746851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408154.881516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408155.008040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408155.155352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408155.283669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408155.412997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408155.545755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408155.675450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408155.795428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408155.915408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408156.045262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408156.166279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408156.308789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408156.421531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408156.552222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408156.679657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408156.806935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408156.942494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408157.068717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408157.209871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408157.354534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408157.467342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408157.608954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408157.728505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408157.858917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408158.007901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408158.134205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408158.239094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408158.387604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408158.488366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408158.617701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408158.746356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408158.865443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408159.007248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408159.112659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408159.238028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408159.362444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408159.482850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408159.614446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408159.743664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408159.869360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408159.994977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408160.121684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408160.256059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408160.378745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408160.503270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408160.642986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408160.770277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408160.912488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408161.043102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408161.176603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408161.304785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408161.425871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408161.542456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408161.682269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408161.810483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408161.937269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408162.064529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408162.200878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408162.322718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408162.483225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408162.600870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408162.715391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408162.853820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408162.978863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408163.108338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408163.238647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408163.362335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408163.487632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408163.629859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408163.769128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408163.881076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408164.019106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408164.152761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408164.278112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408164.414445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408164.547786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408164.673571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408164.799755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408164.921500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408165.042513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408165.167802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408165.308902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408165.422350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408165.553565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408165.675275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408165.801054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408165.926288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408166.050043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408166.174364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408166.300200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408166.424990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408166.569049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408166.682799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408166.801005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408166.927774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408167.058281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408167.182454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408167.331029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408167.441904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408167.569742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408167.711624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408167.831639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408167.978580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408168.104344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408168.226664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408168.371897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408168.481909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408168.611090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408168.754813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408168.868313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408168.991526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408169.122304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408169.252321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408169.377192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408169.504520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408169.627644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408169.756407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408169.887152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408170.023946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408170.156744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408170.287262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408170.412257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408170.546812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408170.674541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408170.792384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408170.922419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408171.046086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408171.173626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408171.306584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408171.426769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408171.552181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408171.676765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408171.797250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408171.926083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408172.044976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408172.171680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408172.315185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408172.426656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408172.549768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408172.679764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408172.820820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408172.922640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408173.048467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408173.170802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408173.287980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408173.420455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408173.544259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408173.664548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408173.795598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408173.918774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408174.034830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408174.164090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408174.295862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408174.412852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408174.541705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408174.667453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408174.798671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408174.942633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408175.046563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408175.176553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408175.297994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408175.424101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408175.548341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408175.683398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408175.823181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408175.948669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408176.063115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408176.194002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408176.334896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408176.453146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408176.590057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408176.716649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408176.856210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408176.975372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408177.102922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408177.226437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408177.363182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408177.483055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408177.602023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408177.732598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408177.859984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408177.981791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408178.115674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408178.244444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408178.372541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408178.498587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408178.630945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408178.761168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408178.907728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408179.034756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408179.156164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408179.285728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408179.403612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408179.539475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408179.669622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408179.790164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408179.915025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408180.047454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408180.165823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408180.302363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408180.424594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408180.544653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408180.675452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408180.799149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408180.921164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408181.049494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408181.168709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408181.299531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408181.434106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408181.557023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408181.676651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408181.798481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408181.935327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408182.069801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408182.191432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408182.309537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408182.442048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408182.568486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408182.692798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408182.819888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408182.962935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408183.103883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408183.222558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408183.356800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408183.475437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408183.601219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408183.727865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408183.854304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408183.980092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408184.105762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408184.233467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408184.361547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408184.486304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408184.610480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408184.735830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408184.861849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408184.985344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408185.112464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408185.236207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408185.378543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408185.481857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408185.612143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408185.734952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408185.861763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408186.004731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408186.170654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408186.384916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408186.586373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408186.731430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408186.845943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408186.979732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408187.095363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408187.227176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408187.355525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408187.484516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408187.604993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408187.741294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408187.878884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408187.987786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408188.110124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408188.241056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408188.366217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408188.491958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408188.607889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408188.738352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408188.866507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408188.993608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408189.116391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408189.244496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408189.365045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408189.489114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408189.613623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408189.738093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408189.858892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408189.985635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408190.108658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408190.237285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408190.376820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408190.501581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408190.617988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408190.737160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408190.856427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408190.987282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408191.110891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408191.237818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408191.371588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408191.488347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408191.612848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408191.747234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408191.882178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408192.005881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408192.143928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408192.273160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408192.416828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408192.549237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408192.672007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408192.803903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408192.930805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408193.060287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408193.188669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408193.316827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408193.440970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408193.568964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408193.701020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408193.852899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408193.972544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408194.099829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408194.233227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408194.357501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408194.483937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408194.609540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408194.735756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408194.861772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408194.983108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408195.111572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408195.232824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408195.365973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408195.494327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408195.614242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408195.739455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408195.869734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408195.989694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408196.116336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408196.241009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408196.386906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408196.491151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408196.630867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408196.755561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408196.881275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408197.005811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408197.149976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408197.276624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408197.419765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408197.540346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408197.666010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408197.791373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408197.917612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408198.047387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408198.173903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408198.301725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408198.432245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408198.554221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408198.687900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408198.829121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408198.955393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408199.085235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408199.209893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408199.341121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408199.505374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408199.805636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408199.984127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408200.153091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408200.304782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408200.495750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408200.669710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408200.819298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408200.982670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408201.172987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408201.364309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408201.543112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408201.657598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408201.790412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408201.912469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408202.042117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408202.163959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408202.299530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408202.416791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408202.546540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408202.690366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408202.800174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408202.924316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408203.061360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408203.169738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408203.313117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408203.429518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408203.551751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408203.682945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408203.803528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408203.923703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408204.049644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408204.168729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408204.299807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408204.441158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408204.675565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408204.795213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408204.921794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408205.046853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408205.189970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408205.299379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408205.440251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408205.569999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408205.702781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408205.807427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408205.940501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408206.079623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408206.213922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408206.331399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408206.473809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408206.587487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408206.727027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408206.845121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408206.971914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408207.101154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408207.231505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408207.356205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408207.482321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408207.605670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408207.723821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408207.857168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408207.984121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408208.101318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408208.245023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408208.357786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408208.483205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408208.609963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408208.749983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408208.855793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408208.988413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408209.109928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408209.235765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408209.356869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408209.480206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408209.600643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408209.756456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408209.881567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408210.003648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408210.138875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408210.278716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408210.424305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408210.549456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408210.664185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408210.793606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408210.922647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408211.052425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408211.172925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408211.300397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408211.422411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408211.547756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408211.676533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408211.803394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408211.928702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408212.054214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408212.178928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408212.306672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408212.442464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408212.563272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408212.683650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408212.830095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408212.959026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408213.089883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408213.229320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408213.357486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408213.487617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408213.609157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408213.731025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408213.858559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408213.996762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408214.113174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408214.237299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408214.360262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408214.490078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408214.613059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408214.739623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408214.870723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408215.000308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408215.126897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408215.246051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408215.389243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408215.515720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408215.652428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408215.790710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408215.920830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408216.037821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408216.188065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408216.295454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408216.421083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408216.549468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408216.678917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408216.798289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408216.925619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408217.044670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408217.172287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408217.300605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408217.428728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408217.536396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408217.677733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408217.799714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408217.939091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408218.046765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408218.167549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408218.298268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408218.416091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408218.536764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408218.660842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408218.788638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408218.920689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408219.041809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408219.168372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408219.295163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408219.424355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408219.565874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408219.675596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408219.800091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408219.929767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408220.056079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408220.181591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408220.309030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408220.443266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408220.571803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408220.697664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408220.830018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408220.959969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408221.080380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408221.215285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408221.350144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408221.479009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408221.603554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408221.761641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408221.879269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408222.019391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408222.138141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408222.295893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408222.402942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408222.529863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408222.671345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408222.792668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408222.923430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408223.040439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408223.167029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408223.294410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408223.410476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408223.538681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408223.672172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408223.813708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408223.930911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408224.064835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408224.192012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408224.335460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408224.463635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408224.590652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408224.732752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408224.860396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408224.978122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408225.116370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408225.236248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408225.360965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408225.483084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408225.604259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408225.731672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408225.870893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408225.983873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408226.117221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408226.239731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408226.367195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408226.490647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408226.613816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408226.736120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408226.866348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408226.991526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408227.116233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408227.254662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408227.380926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408227.504541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408227.651463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408227.777461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408227.903484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408228.048352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408228.170315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408228.293451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408228.421163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408228.563435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408228.673888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408228.793971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408228.928183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408229.052349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408229.191129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408229.300289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408229.420594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408229.546098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408229.674478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408229.794941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408229.941868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408230.048035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408230.180433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408230.297488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408230.424608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408230.547425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408230.689920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408230.798487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408230.928035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408231.051667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408231.181470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408231.302200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408231.441093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408231.556466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408231.691031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408231.819963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408231.944771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408232.080057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408232.230587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408232.339864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408232.476052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408232.605157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408232.724917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408232.852318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408232.982922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408233.106898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408233.230985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408233.355186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408233.482249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408233.600412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408233.727144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408233.857130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408233.980444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408234.110022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408234.235935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408234.357776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408234.483634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408234.609688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408234.745884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408234.859071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408234.988173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408235.107934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408235.232960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408235.357436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408235.488751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408235.620641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408235.750493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408235.900189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408236.010712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408236.151792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408236.312798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408236.412365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408236.546385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408236.670566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408236.803525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408236.928735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408237.073730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408237.197427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408237.334882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408237.470361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408237.596909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408237.723896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408237.861714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408237.983279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408238.110067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408238.234546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408238.368384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408238.488911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408238.609233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408238.737680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408238.865746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408238.982242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408239.114164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408239.238171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408239.364366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408239.491442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408239.616918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408239.738698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408239.870777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408240.018379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408240.128568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408240.259271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408240.402684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408240.535687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408240.659473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408240.785060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408240.905356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408241.044408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408241.180003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408241.300532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408241.430930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408241.558962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408241.697328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408241.839481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408241.956511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408242.088856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408242.216176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408242.345671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408242.483057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408242.605209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408242.732844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408242.847420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408242.984998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408243.098610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408243.237063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408243.355497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408243.486484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408243.608577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408243.737319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408243.858343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408243.979414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408244.107262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408244.232473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408244.359112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408244.490092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408244.611850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408244.738269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408244.858336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408244.977740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408245.119715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408245.237982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408245.362391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408245.492414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408245.614400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408245.745014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408245.875947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408246.003104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408246.144891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408246.265235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408246.396558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408246.524912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408246.657341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408246.781249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408246.920018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408247.037050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408247.156507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408247.292270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408247.424224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408247.546151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408247.672658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408247.807506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408247.927702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408248.061532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408248.181117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408248.322290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408248.458730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408248.587747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408248.714660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408248.838532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408248.976536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408249.123419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408249.235596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408249.362974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408249.499769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408249.636935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408249.754099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408249.894960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408250.023744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408250.152698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408250.282419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408250.408900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408250.535285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408250.661260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408250.782441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408250.912274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408251.046020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408251.170605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408251.298056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408251.421745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408251.551568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408251.687673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408251.808330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408251.938811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408252.074593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408252.214665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408252.333058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408252.459191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408252.590193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408252.725131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408252.846795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408252.983085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408253.103750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408253.235094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408253.352591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408253.488501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408253.608741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408253.736428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408253.862968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408253.991886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408254.112984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408254.238251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408254.364286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408254.485320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408254.618169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408254.747110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408254.861448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408255.001726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408255.108527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408255.242172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408255.367705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408255.478955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408255.604053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408255.737991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408255.855788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408255.988138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408256.111348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408256.237942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408256.356188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408256.480787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408256.604499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408256.736444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408256.859873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408256.984371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408257.110140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408257.234476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408257.362386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408257.490021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408257.621777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408257.752713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408257.884764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408258.006887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408258.151207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408258.275609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408258.400794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408258.536938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408258.663859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408258.789701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408258.916876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408259.041534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408259.167904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408259.295491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408259.420756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408259.564881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408259.676026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408259.813617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408259.937600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408260.080112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408260.191954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408260.327775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408260.465477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408260.590475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408260.727691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408260.855625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408260.976466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408261.106737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408261.226446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408261.358265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408261.483476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408261.602909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408261.729498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408261.859392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408261.991981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408262.118349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408262.241837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408262.373254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408262.496407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408262.618829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408262.759753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408262.883453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408263.010626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408263.149432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408263.274548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408263.427937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408263.542404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408263.678644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408263.798125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408263.928146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408264.050715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408264.169328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408264.298956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408264.429482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408264.552743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408264.674376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408264.814704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408264.936655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408265.076708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408265.210591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408265.334720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408265.473888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408265.598427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408265.733983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408265.845786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408265.982977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408266.107160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408266.232537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408266.361224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408266.487106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408266.612460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408266.741271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408266.872586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408266.986234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408267.110013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408267.237497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408267.384743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408267.494094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408267.632672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408267.757840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408267.880919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408268.037924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408268.151097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408268.286762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408268.406586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408268.544181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408268.665706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408268.795253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408268.918285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408269.044889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408269.171263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408269.296195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408269.411195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408269.542866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408269.672548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408269.805098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408269.920039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408270.048374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408270.174028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408270.316851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408270.424255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408270.550468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408270.675038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408270.810432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408270.942164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408271.079427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408271.208718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408271.333580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408271.465686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408271.597928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408271.737668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408271.864490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408272.003837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408272.119193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408272.253308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408272.403915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408272.536998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408272.668061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408272.788760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408272.912090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408273.060895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408273.173692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408273.297937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408273.428226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408273.554079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408273.691685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408273.814979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408273.939706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408274.071887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408274.211779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408274.337360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408274.460441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408274.586418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408274.732187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408274.843498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408274.970103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408275.107800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408275.239489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408275.358229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408275.486496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408275.595074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408275.738695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408275.856403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408275.985850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408276.107216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408276.233640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408276.361970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408276.488900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408276.609820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408276.737127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408276.860427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408276.985950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408277.111183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408277.235583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408277.365472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408277.490573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408277.616220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408277.747885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408277.882291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408278.020101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408278.154908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408278.293864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408278.418988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408278.545599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408278.671487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408278.798217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408278.922404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408279.048171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408279.173412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408279.302771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408279.427821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408279.564942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408279.698116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408279.836303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408279.963388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408280.107307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408280.219307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408280.347643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408280.469901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408280.595673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408280.726470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408280.856717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408280.984915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408281.123146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408281.251621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408281.363838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408281.488523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408281.616709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408281.771820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408281.902835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408282.024534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408282.156397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408282.291033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408282.421678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408282.558679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408282.690316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408282.818089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408282.946125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408283.093138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408283.212976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408283.347882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408283.485084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408283.598651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408283.724916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408283.858412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408283.998067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408284.104316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408284.236801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408284.375728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408284.495854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408284.602733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408284.738586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408284.865904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408284.990813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408285.127645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408285.244440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408285.388430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408285.503006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408285.631215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408285.763964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408285.904600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408286.030442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408286.161215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408286.285734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408286.418957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408286.547520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408286.678658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408286.805343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408286.924628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408287.046738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408287.176414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408287.304308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408287.431772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408287.566800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408287.694144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408287.828183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408287.962038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408288.090332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408288.224308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408288.357069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408288.470510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408288.601506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408288.724875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408288.850182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408288.967902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408289.096913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408289.223530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408289.359782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408289.482452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408289.609601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408289.731016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408289.856947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408289.983451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408290.109580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408290.233181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408290.378024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408290.486236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408290.615607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408290.749275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408290.900110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408291.018382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408291.164649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408291.283892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408291.437109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408291.535094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408291.665555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408291.792408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408291.912646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408292.042152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408292.166490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408292.288751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408292.413805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408292.535882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408292.667278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408292.791796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408292.938728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408293.046312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408293.170902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408293.296804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408293.419001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408293.545103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408293.678184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408293.814500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408293.934838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408294.058296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408294.192858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408294.314769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408294.452832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408294.568982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408294.712784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408294.858216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408294.975531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408295.105302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408295.248100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408295.359225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408295.480536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408295.607074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408295.744565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408295.885958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408296.009033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408296.162804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408296.289984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408296.400350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408296.530601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408296.657207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408296.776952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408296.916180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408297.040163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408297.167705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408297.289134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408297.413680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408297.562747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408297.671282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408297.799464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408297.928292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408298.043033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408298.172316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408298.292760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408298.421324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408298.564367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408298.669878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408298.796859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408298.926426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408299.053952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408299.194695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408299.314944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408299.442774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408299.575917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408299.704745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408299.832671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408299.964554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408300.099583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408300.237257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408300.360734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408300.483961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408300.616390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408300.743123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408300.872072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408300.999664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408301.117186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408301.243425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408301.368302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408301.490340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408301.622558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408301.751396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408301.878620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408302.011959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408302.148033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408302.275141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408302.412422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408302.537904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408302.666225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408302.787959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408302.916100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408303.041478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408303.175204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408303.314736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408303.429567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408303.555043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408303.682259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408303.814015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408303.945158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408304.078233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408304.222225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408304.343608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408304.481349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408304.592704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408304.725499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408304.842953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408304.981997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408305.105968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408305.230802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408305.356201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408305.492491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408305.604018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408305.729993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408305.875528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408305.985055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408306.111060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408306.236233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408306.357332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408306.482368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408306.609748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408306.736806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408306.864124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408306.991844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408307.107418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408307.239688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408307.379172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408307.521615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408307.628600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408307.760202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408307.896512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408308.036084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408308.182440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408308.296996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408308.438329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408308.552133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408308.670758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408308.795618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408308.923504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408309.052060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408309.188149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408309.317631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408309.430063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408309.554144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408309.682783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408309.812626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408309.942660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408310.074970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408310.198638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408310.335798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408310.486181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408310.604462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408310.730307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408310.855064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408310.980472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408311.110223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408311.238560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408311.366132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408311.494198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408311.648125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408311.774204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408311.915646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408312.030735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408312.166160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408312.289581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408312.418124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408312.547135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408312.669529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408312.795463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408312.922168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408313.052693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408313.178919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408313.313795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408313.435298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408313.569201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408313.697347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408313.844789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408313.980080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408314.096658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408314.222321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408314.349239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408314.473356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408314.593171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408314.724928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408314.854070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408314.982430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408315.104641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408315.234925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408315.356794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408315.490503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408315.612872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408315.738741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408315.859589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408315.984709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408316.109477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408316.229064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408316.368802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408316.493993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408316.608913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408316.739555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408316.859676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408316.999949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408317.111488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408317.234514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408317.362952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408317.498328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408317.628134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408317.748493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408317.881690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408318.014306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408318.136477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408318.273125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408318.400441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408318.542509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408318.659883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408318.789942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408318.913213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408319.037844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408319.163843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408319.287236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408319.415508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408319.552791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408319.864347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408320.046530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408320.231575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408320.401192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408320.561021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408320.729238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408320.923586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408321.105680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408321.252642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408321.424851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408321.593071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408321.739206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408321.927627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408322.072498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408322.195175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408322.339260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408322.462729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408322.604153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408322.721143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408322.858048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408322.984954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408323.110796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408323.232757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408323.370934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408323.484007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408323.606007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408323.732420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408323.863623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408324.002108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408324.128544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408324.270358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408324.391474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408324.538498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408324.660154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408324.789119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408324.925032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408325.130491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408325.292496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408325.436838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408325.550852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408325.678722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408325.806133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408325.943206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408326.063029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408326.197956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408326.321178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408326.461174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408326.584513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408326.719279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408326.846399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408326.979920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408327.106598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408327.233897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408327.371110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408327.486702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408327.612843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408327.736916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408327.861996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408327.988758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408328.127216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408328.257994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408328.379738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408328.522498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408328.647128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408328.774453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408328.900236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408329.023549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408329.152816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408329.279099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408329.410923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408329.542783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408329.669663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408329.798731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408329.919420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408330.042327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408330.171624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408330.316564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408330.435758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408330.556051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408330.681517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408330.822790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408330.959473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408331.083767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408331.220858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408331.347865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408331.481000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408331.600190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408331.727394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408331.855501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408331.976620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408332.106225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408332.231481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408332.355753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408332.481532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408332.609644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408332.729536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408332.871136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408332.974044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408333.111716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408333.249198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408333.362908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408333.495568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408333.614893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408333.742194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408333.890418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408334.022209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408334.150242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408334.285039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408334.412856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408334.540078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408334.660177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408334.786961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408334.924613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408335.045237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408335.166924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408335.294801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408335.430029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408335.544703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408335.665195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408335.809038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408335.909731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408336.037934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408336.166883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408336.314713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408336.421548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408336.564647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408336.664636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408336.795245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408336.927693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408337.043743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408337.166711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408337.295693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408337.424496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408337.542897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408337.667208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408337.801290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408337.926512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408338.053233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408338.180882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408338.301897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408338.454251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408338.576330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408338.697494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408338.847045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408338.968468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408339.099985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408339.230897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408339.357338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408339.487306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408339.609478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408339.744165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408339.870376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408340.015789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408340.129916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408340.273796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408340.406670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408340.543324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408340.666959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408340.778341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408340.907370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408341.036671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408341.164566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408341.291965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408341.433862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408341.545167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408341.673745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408341.819816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408341.960828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408342.088771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408342.219759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408342.351612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408342.478401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408342.612180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408342.734420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408342.862180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408342.989466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408343.115750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408343.243761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408343.396068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408343.501933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408343.646726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408343.774417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408343.922688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408344.035636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408344.162168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408344.292381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408344.422683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408344.541794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408344.669303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408344.792799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408344.920179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408345.041929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408345.169954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408345.296603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408345.427687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408345.542484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408345.670824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408345.794749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408345.925512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408346.044580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408346.166653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408346.295982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408346.436062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408346.553540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408346.683863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408346.808922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408346.936656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408347.067575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408347.223980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408347.340121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408347.459507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408347.604545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408347.731130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408347.862277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408347.981185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408348.108580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408348.235713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408348.377903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408348.481317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408348.603883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408348.734613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408348.862040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408348.983049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408349.123720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408349.247236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408349.378780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408349.523520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408349.648721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408349.776985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408349.917711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408350.038996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408350.164704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408350.293004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408350.414503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408350.545068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408350.665278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408350.791118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408350.916867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408351.048693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408351.174519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408351.296647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408351.431561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408351.552139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408351.681026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408351.813634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408351.939302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408352.065949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408352.208726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408352.353155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408352.469073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408352.606194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408352.721805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408352.853485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408352.982389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408353.106798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408353.230071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408353.355071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408353.478992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408353.604111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408353.733996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408353.863656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408353.990261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408354.114142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408354.238024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408354.364273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408354.505924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408354.628572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408354.764302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408354.896620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408355.028180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408355.156914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408355.288540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408355.408725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408355.537631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408355.660268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408355.795455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408355.935968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408356.075930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408356.187039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408356.318747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408356.459755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408356.590838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408356.729228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408356.844572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408356.970411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408357.089779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408357.225585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408357.353984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408357.483284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408357.607025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408357.742229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408357.857510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408357.985074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408358.102697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408358.229642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408358.361603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408358.491872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408358.614169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408358.740281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408358.874985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408359.000085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408359.128921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408359.269794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408359.390174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408359.523767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408359.646175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408359.774557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408359.898091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408360.040587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408360.171533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408360.297261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408360.423031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408360.554052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408360.684902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408360.799853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408360.925018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408361.050188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408361.172202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408361.301120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408361.428547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408361.554444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408361.687743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408361.832879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408361.971917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408362.096885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408362.229369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408362.356349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408362.473934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408362.608168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408362.724888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408362.858060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408362.982567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408363.110305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408363.239601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408363.362631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408363.501075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408363.627649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408363.759579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408363.899232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408364.028349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408364.155578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408364.282803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408364.406359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408364.537599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408364.662926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408364.800870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408364.916523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408365.039820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408365.173021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408365.306184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408365.431036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408365.562865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408365.687622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408365.821019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408365.930850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408366.063388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408366.196535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408366.334605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408366.464117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408366.599708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408366.733167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408366.852945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408366.974428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408367.101629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408367.230147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408367.353245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408367.483160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408367.602051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408367.731603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408367.861728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408367.983259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408368.115089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408368.234310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408368.372900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408368.480076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408368.605715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408368.733732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408368.855292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408368.987957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408369.113145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408369.237294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408369.361873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408369.497342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408369.630736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408369.762663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408369.916824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408370.037098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408370.158038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408370.284784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408370.419748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408370.543563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408370.673116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408370.808443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408370.925095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408371.047839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408371.177659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408371.302888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408371.437356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408371.570251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408371.712846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408371.846259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408371.974231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408372.115433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408372.223841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408372.362914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408372.479091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408372.605087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408372.731276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408372.860202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408372.990343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408373.113664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408373.240552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408373.368140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408373.499367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408373.630789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408373.768710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408373.901955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408374.025525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408374.159724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408374.286602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408374.401724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408374.546762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408374.688100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408374.794258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408374.924460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408375.046694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408375.172187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408375.295785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408375.435783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408375.550139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408375.700812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408375.801530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408375.941238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408376.063096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408376.193771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408376.330417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408376.476930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408376.601923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408376.742669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408376.850357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408376.983572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408377.094622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408377.223473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408377.353010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408377.478232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408377.609293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408377.728571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408377.859109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408377.987213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408378.110003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408378.235996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408378.358323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408378.480235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408378.610200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408378.746277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408378.871915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408379.001196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408379.125906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408379.269371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408379.403688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408379.534418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408379.653625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408379.790023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408379.909513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408380.042069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408380.170043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408380.288951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408380.434002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408380.562591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408380.665852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408380.795643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408380.923253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408381.059377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408381.188617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408381.332056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408381.447053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408381.584180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408381.712725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408381.854274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408381.974440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408382.104823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408382.224254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408382.358825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408382.482983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408382.612723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408382.726303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408382.872889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408382.979555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408383.116178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408383.230995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408383.360306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408383.484065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408383.612937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408383.746610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408383.869346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408383.986548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408384.113620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408384.247758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408384.374429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408384.503981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408384.645230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408384.777798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408384.908418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408385.032239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408385.158685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408385.280298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408385.407140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408385.548684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408385.669555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408385.807792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408385.928843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408386.049223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408386.177291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408386.311928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408386.442101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408386.579416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408386.686185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408386.822507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408386.957373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408387.099163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408387.226138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408387.355928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408387.486855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408387.605871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408387.733542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408387.859289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408388.023000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408388.124480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408388.288067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408388.383842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408388.531891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408388.664292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408388.790174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408388.914814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408389.043492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408389.166756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408389.291296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408389.417641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408389.560460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408389.670309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408389.799747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408389.932610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408390.057658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408390.184754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408390.315367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408390.450944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408390.582261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408390.715439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408390.837118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408390.970242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408391.096987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408391.225650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408391.351384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408391.468496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408391.606948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408391.727299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408391.860991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408391.986797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408392.121954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408392.248474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408392.394425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408392.519989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408392.663410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408392.779922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408392.911803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408393.037276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408393.169109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408393.294954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408393.414685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408393.540990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408393.666527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408393.796560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408393.917260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408394.048203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408394.165241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408394.292717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408394.433952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408394.540072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408394.671839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408394.792239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408394.919158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408395.040962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408395.158442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408395.289521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408395.419438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408395.540538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408395.668687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408395.793601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408395.914830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408396.039858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408396.164467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408396.292614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408396.418425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408396.546692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408396.682562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408396.811981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408396.949005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408397.066148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408397.209882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408397.337326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408397.471911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408397.602795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408397.728057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408397.848302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408397.969181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408398.110389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408398.236038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408398.361334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408398.489359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408398.626688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408398.752749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408398.875681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408399.018555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408399.142885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408399.290498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408399.409503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408399.537986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408399.674201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408399.825050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408399.937374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408400.079592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408400.209181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408400.344156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408400.468359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408400.597630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408400.720045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408400.854858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408400.981425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408401.125091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408401.232063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408401.365560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408401.490337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408401.612290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408401.770540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408401.907089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408402.026944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408402.154964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408402.287735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408402.428642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408402.544267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408402.695154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408402.800055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408402.927817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408403.064133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408403.182885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408403.314984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408403.457172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408403.579459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408403.720073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408403.859165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408403.975847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408404.093420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408404.219621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408404.344688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408404.480562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408404.592492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408404.731144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408404.843283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408404.976571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408405.099969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408405.222214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408405.350248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408405.481862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408405.598089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408405.725980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408405.842638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408405.967563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408406.098888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408406.226144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408406.348126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408406.472655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408406.597163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408406.722517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408406.847156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408406.968973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408407.091692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408407.226695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408407.342336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408407.473865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408407.592750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408407.728576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408407.849514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408407.977149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408408.095108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408408.231016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408408.359364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408408.473312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408408.599867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408408.727717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408408.850374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408408.978430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408409.107811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408409.247756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408409.362480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408409.504231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408409.637171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408409.763957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408409.903422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408410.026867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408410.157268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408410.295090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408410.418998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408410.545773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408410.687228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408410.798598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408410.922031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408411.057148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408411.184211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408411.309237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408411.452423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408411.567499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408411.708892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408411.835523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408411.972190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408412.094217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408412.225924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408412.357466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408412.473707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408412.595767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408412.729156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408412.850036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408412.987120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408413.104980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408413.233584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408413.355950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408413.474920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408413.621552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408413.724638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408413.857466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408413.988991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408414.120451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408414.235247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408414.355458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408414.497540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408414.623196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408414.759881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408414.892639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408415.037789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408415.166554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408415.289511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408415.405823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408415.533018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408415.683132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408415.796685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408415.926028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408416.045363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408416.176499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408416.297481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408416.446269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408416.559435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408416.684324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408416.809403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408416.962472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408417.077913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408417.212128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408417.338530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408417.471031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408417.595658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408417.724719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408417.848887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408417.976093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408418.108030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408418.229108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408418.354063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408418.479671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408418.608449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408418.732095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408418.860480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408418.992995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408419.119486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408419.247597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408419.387360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408419.510113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408419.647851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408419.777769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408419.903587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408420.032774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408420.170111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408420.291589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408420.430242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408420.543914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408420.670683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408420.793852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408420.914957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408421.042700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408421.166653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408421.294452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408421.434757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408421.550392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408421.669290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408421.817937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408421.922818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408422.043676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408422.174426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408422.299333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408422.431179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408422.559878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408422.691669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408422.818990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408422.957365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408423.087874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408423.207015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408423.331928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408423.477518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408423.614140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408423.727071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408423.850734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408423.983192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408424.104116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408424.229906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408424.349970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408424.493192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408424.615658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408424.724816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408424.847189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408424.976445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408425.121930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408425.233314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408425.355665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408425.482348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408425.609859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408425.732893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408425.865751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408425.995713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408426.126542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408426.264136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408426.394476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408426.540999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408426.663987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408426.784151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408426.908445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408427.039679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408427.171066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408427.296316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408427.430264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408427.556785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408427.687060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408427.812641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408427.963597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408428.087019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408428.208605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408428.343440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408428.470522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408428.599583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408428.716908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408428.844535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408428.970130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408429.104640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408429.219807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408429.339559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408429.461642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408429.600519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408429.725723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408429.851613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408429.970815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408430.113069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408430.223360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408430.348446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408430.493815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408430.604714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408430.732655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408430.853689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408430.984056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408431.108580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408431.238139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408431.359089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408431.494668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408431.611267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408431.766752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408431.891292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408432.035789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408432.157563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408432.282235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408432.419926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408432.542779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408432.687710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408432.790439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408432.918606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408433.048693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408433.172240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408433.300250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408433.420783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408433.558806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408433.685602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408433.813946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408433.952073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408434.097969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408434.219482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408434.348959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408434.476801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408434.604462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408434.722137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408434.850055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408434.995625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408435.126018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408435.226927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408435.349917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408435.473122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408435.602533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408435.724809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408435.873218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408435.976421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408436.109009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408436.230998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408436.369990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408436.483615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408436.613153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408436.744206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408436.871978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408437.000739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408437.133864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408437.271931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408437.394062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408437.530700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408437.655819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408437.789202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408437.913627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408438.038298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408438.165034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408438.291450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408438.416855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408438.540663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408438.659667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408438.783920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408438.907322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408439.029296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408439.154385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408439.279248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408439.406991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408439.531909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408439.655586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408439.781991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408439.913104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408440.034624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408440.181741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408440.294824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408440.424944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408440.723741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408440.952893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408441.150065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408441.286814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408441.505194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408441.640091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408441.817519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408441.983109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408442.150201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408442.309949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408442.494151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408442.650593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408442.856687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408443.019563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408443.145315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408443.270241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408443.406495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408443.535750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408443.648597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408443.769037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408443.909267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408444.025968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408444.160487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408444.295323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408444.408246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408444.531723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408444.659506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408444.776866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408444.918963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408445.029372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408445.164403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408445.282230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408445.416119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408445.541141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408445.667233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408445.795828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408445.968758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408446.180763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408446.310768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408446.434417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408446.557120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408446.677897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408446.813954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408446.941509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408447.063771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408447.188454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408447.337021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408447.466747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408447.599904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408447.736593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408447.852510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408447.976775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408448.099131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408448.247336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408448.346992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408448.479483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408448.601364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408448.730706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408448.849867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408448.978263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408449.103653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408449.228870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408449.350015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408449.481606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408449.601795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408449.731320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408449.858773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408449.986709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408450.118086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408450.247382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408450.378988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408450.509072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408450.642194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408450.781988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408450.905477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408451.030763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408451.161749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408451.308755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408451.426486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408451.561113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408451.704789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408451.846939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408451.973112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408452.097798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408452.218022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408452.349603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408452.473663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408452.601707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408452.728110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408452.859322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408452.984082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408453.117829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408453.254372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408453.394262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408453.515820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408453.645935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408453.778105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408453.911227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408454.030686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408454.161505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408454.280901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408454.408759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408454.531204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408454.658529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408454.787022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408454.919353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408455.032960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408455.154123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408455.285550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408455.414297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408455.531667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408455.666232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408455.800910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408455.918492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408456.048583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408456.174077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408456.298182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408456.426653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408456.564108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408456.701522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408456.817681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408456.955298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408457.101213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408457.211121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408457.342213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408457.465634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408457.592560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408457.727968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408457.852569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408458.001151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408458.110650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408458.253893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408458.362702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408458.487695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408458.624941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408458.758468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408458.880893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408459.018258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408459.155814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408459.279321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408459.402634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408459.536272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408459.664676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408459.793735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408459.916150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408460.043006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408460.166367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408460.289934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408460.418661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408460.550749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408460.668603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408460.801944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408460.940029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408461.079573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408461.208457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408461.346405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408461.466246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408461.601522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408461.728385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408461.863799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408461.987743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408462.115460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408462.235526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408462.368333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408462.497414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408462.654085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408462.764345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408462.893928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408463.026120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408463.144855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408463.275525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408463.413334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408463.538507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408463.659646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408463.792256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408463.917851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408464.036618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408464.157053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408464.282381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408464.407636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408464.530687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408464.654018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408464.781061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408464.903358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408465.033494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408465.167717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408465.289310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408465.416145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408465.540320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408465.667590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408465.791616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408465.920276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408466.048019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408466.170648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408466.293817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408466.420677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408466.548668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408466.682365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408466.815337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408466.946624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408467.078297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408467.208104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408467.334670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408467.468048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408467.599283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408467.728345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408467.843385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408467.987656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408468.108163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408468.236883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408468.377177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408468.499104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408468.642247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408468.767024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408468.895408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408469.021107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408469.150386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408469.278992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408469.404669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408469.537445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408469.652274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408469.779273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408469.921526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408470.044707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408470.168524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408470.293213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408470.418629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408470.557156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408470.660606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408470.800894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408470.918392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408471.044072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408471.167147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408471.299772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408471.420322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408471.548593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408471.665118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408471.799705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408471.932278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408472.056942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408472.186910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408472.334064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408472.468357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408472.616210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408472.722791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408472.848687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408472.974502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408473.105968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408473.231230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408473.358610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408473.486589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408473.626362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408473.752914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408473.868823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408473.996807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408474.139956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408474.270829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408474.398715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408474.532217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408474.662330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408474.800665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408474.912491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408475.047988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408475.180110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408475.289619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408475.422691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408475.538174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408475.670588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408475.797568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408475.938289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408476.045094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408476.174273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408476.307917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408476.438402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408476.578742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408476.702211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408476.844159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408476.973695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408477.092489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408477.225837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408477.352934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408477.489644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408477.606427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408477.732126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408477.856679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408477.977832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408478.109624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408478.230231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408478.351117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408478.482972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408478.606716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408478.748006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408478.856718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408478.993582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408479.105933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408479.232497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408479.356688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408479.475823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408479.601756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408479.726333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408479.853222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408479.981110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408480.111372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408480.235262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408480.354954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408480.475790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408480.603012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408480.732340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408480.857165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408480.997031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408481.095073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408481.227321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408481.348942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408481.479036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408481.602703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408481.723827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408481.847566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408481.974047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408482.099840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408482.225705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408482.348811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408482.497191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408482.599098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408482.731356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408482.858823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408482.987162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408483.124033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408483.246722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408483.369909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408483.514647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408483.643415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408483.774730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408483.901327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408484.023958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408484.160394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408484.284791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408484.415246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408484.556550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408484.664587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408484.792333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408484.904703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408485.039263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408485.168125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408485.296674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408485.416173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408485.547993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408485.673600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408485.804461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408485.925652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408486.083347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408486.284507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408486.514722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408486.801724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408486.979904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408487.170016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408487.293888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408487.431160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408487.558121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408487.685047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408487.822615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408487.970371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408488.095733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408488.244068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408488.341460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408488.479921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408488.611906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408488.745114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408488.886950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408489.003313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408489.134260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408489.275667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408489.411233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408489.533363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408489.652215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408489.778342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408489.900497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408490.031759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408490.166229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408490.287969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408490.415625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408490.537035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408490.663791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408490.794033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408490.920814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408491.061305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408491.191040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408491.309691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408491.454446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408491.581882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408491.722489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408491.851336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408491.975344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408492.101342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408492.228279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408492.346581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408492.477911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408492.607749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408492.736540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408492.868390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408492.997620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408493.150417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408493.268404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408493.408916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408493.534054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408493.658751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408493.782975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408493.913817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408494.050049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408494.172372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408494.294290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408494.425826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408494.554564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408494.675409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408494.811437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408494.952018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408495.075369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408495.202587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408495.351680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408495.467856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408495.587789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408495.725070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408495.860403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408495.981281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408496.099345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408496.234054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408496.367194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408496.476659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408496.601608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408496.723677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408496.851555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408496.977883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408497.097235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408497.232841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408497.357809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408497.496708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408497.618313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408497.747275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408497.890303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408498.033310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408498.160310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408498.303137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408498.436197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408498.544415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408498.667256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408498.792851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408498.913588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408499.044885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408499.163714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408499.293725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408499.414904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408499.541496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408499.660986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408499.799298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408499.913717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408500.035356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408500.160671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408500.290748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408500.416266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408500.542892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408500.671381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408500.807775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408500.916008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408501.039631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408501.171085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408501.304124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408501.433787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408501.562293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408501.689863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408501.816420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408501.955344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408502.090480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408502.213810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408502.344956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408502.473751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408502.615482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408502.727300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408502.850672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408502.973589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408503.098816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408503.228811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408503.352395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408503.479004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408503.617957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408503.726478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408503.854083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408503.972584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408504.102395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408504.229951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408504.355855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408504.475355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408504.602867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408504.729749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408504.859149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408504.983127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408505.110047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408505.241136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408505.362190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408505.493114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408505.623303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408505.751028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408505.892899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408506.018568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408506.142108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408506.273084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408506.412114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408506.537489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408506.661552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408506.785613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408506.912757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408507.033293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408507.160706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408507.285707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408507.431479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408507.558632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408507.674803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408507.821092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408507.923837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408508.050267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408508.185452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408508.310198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408508.452832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408508.575734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408508.715441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408508.842651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408508.963834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408509.094718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408509.224984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408509.343186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408509.479805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408509.614933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408509.735614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408509.858165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408509.984679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408510.110404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408510.243416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408510.388329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408510.494103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408510.632387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408510.776520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408510.895554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408511.032449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408511.151003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408511.284215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408511.406272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408511.526888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408511.660586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408511.775886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408511.909621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408512.037522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408512.168332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408512.323323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408512.444309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408512.579777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408512.721294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408512.839247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408512.961499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408513.104461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408513.225688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408513.357841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408513.468742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408513.603946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408513.717950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408513.850394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408513.984109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408514.099637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408514.235887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408514.351305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408514.470961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408514.601284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408514.719661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408514.848222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408514.968230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408515.114457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408515.220490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408515.355386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408515.475808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408515.596223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408515.722942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408515.863355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408515.973905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408516.132411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408516.241290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408516.362770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408516.489776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408516.604645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408516.725273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408516.850069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408516.991431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408517.109518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408517.226339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408517.361269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408517.478243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408517.608036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408517.732193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408517.861743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408517.991177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408518.121665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408518.262137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408518.398332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408518.538289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408518.670397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408518.789091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408518.917053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408519.042743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408519.171026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408519.296194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408519.422117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408519.551050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408519.687368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408519.812499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408519.952222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408520.101005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408520.201940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408520.344596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408520.492827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408520.604362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408520.724754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408520.848608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408520.970702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408521.117416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408521.234173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408521.355155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408521.477051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408521.604251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408521.748015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408521.876037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408522.007520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408522.128756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408522.267939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408522.401844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408522.539678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408522.659179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408522.787201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408522.912777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408523.034204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408523.162206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408523.284554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408523.408262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408523.541968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408523.670504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408523.806067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408523.930130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408524.056926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408524.184372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408524.329165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408524.451572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408524.593448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408524.715762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408524.849520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408524.976612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408525.097489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408525.225864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408525.357634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408525.470176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408525.603424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408525.729532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408525.856138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408525.994455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408526.103073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408526.226788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408526.354466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408526.485709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408526.619744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408526.745678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408526.867089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408526.996044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408527.142826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408527.281808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408527.401636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408527.524949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408527.667594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408527.807716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408527.918631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408528.041509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408528.158219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408528.304727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408528.414830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408528.534633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408528.671154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408528.797097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408528.925063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408529.061026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408529.178807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408529.307750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408529.433217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408529.561044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408529.699993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408529.826733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408529.959794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408530.088140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408530.218059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408530.348830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408530.475449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408530.600856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408530.736100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408530.866639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408531.013113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408531.138332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408531.277993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408531.400057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408531.532652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408531.655327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408531.780469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408531.906782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408532.040579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408532.178294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408532.287372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408532.430289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408532.555779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408532.687895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408532.808066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408532.951952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408533.065908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408533.201188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408533.329203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408533.465956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408533.592815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408533.718380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408533.851916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408533.972263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408534.094131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408534.220326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408534.348407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408534.474741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408534.599149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408534.734443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408534.856975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408534.993411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408535.122771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408535.247792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408535.402935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408535.500857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408535.652926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408535.781735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408535.909205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408536.039429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408536.161509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408536.283161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408536.417905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408536.537566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408536.665301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408536.788811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408536.915843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408537.043831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408537.165556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408537.287786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408537.412772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408537.534213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408537.664886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408537.787176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408537.929134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408538.031695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408538.170310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408538.295933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408538.432382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408538.550192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408538.680315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408538.806575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408538.934155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408539.068371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408539.219101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408539.337686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408539.486052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408539.594731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408539.721462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408539.843438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408539.962236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408540.091182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408540.216948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408540.348077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408540.475022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408540.594214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408540.720601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408540.865966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408540.979966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408541.116335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408541.223827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408541.354653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408541.486111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408541.609117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408541.746410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408541.864459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408542.007994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408542.129092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408542.256394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408542.382146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408542.520184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408542.642476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408542.783263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408542.910459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408543.032655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408543.155166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408543.281665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408543.404444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408543.533515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408543.661745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408543.790949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408543.915616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408544.054526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408544.165070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408544.295113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408544.412667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408544.533709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408544.669631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408544.793123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408544.920428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408545.044083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408545.166893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408545.313673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408545.431732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408545.580407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408545.709150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408545.838455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408545.964881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408546.096448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408546.218145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408546.344887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408546.468906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408546.598701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408546.722400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408546.866963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408546.970015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408547.094274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408547.224438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408547.351101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408547.472843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408547.602588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408547.725435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408547.856125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408547.981355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408548.115648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408548.248495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408548.375003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408548.507968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408548.631979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408548.766242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408548.901473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408549.024054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408549.157491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408549.278775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408549.408283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408549.535778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408549.655637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408549.788376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408549.907709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408550.030147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408550.159129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408550.285019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408550.409549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408550.526315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408550.659749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408550.781480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408550.909987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408551.037303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408551.155343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408551.281743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408551.411410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408551.526562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408551.661543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408551.792596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408551.932456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408552.041344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408552.171269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408552.302098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408552.438004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408552.553690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408552.684641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408552.829158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408552.969995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408553.092681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408553.218588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408553.344702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408553.472889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408553.599269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408553.718352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408553.850159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408553.973915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408554.104929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408554.244675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408554.352426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408554.478358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408554.616553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408554.743981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408554.863999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408554.993926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408555.119501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408555.268810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408555.399767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408555.530751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408555.659375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408555.787259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408555.906738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408556.031410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408556.160350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408556.294236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408556.410426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408556.538399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408556.665049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408556.804018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408556.934944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408557.074886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408557.194270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408557.326439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408557.448838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408557.582122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408557.717769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408557.838817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408557.971873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408558.093742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408558.223152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408558.358095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408558.479520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408558.621166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408558.720067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408558.852158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408558.979655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408559.108418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408559.265738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408559.371234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408559.512308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408559.643441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408559.774189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408559.908020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408560.034892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408560.167475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408560.280748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408560.411333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408560.538767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408560.663798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408560.792358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408560.922299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408561.052430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408561.190611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408561.619887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408561.846685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408562.041041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408562.243768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408562.400633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408562.591033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408562.751966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408562.954636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408563.092453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408563.262543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408563.471935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408563.615269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408563.862616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408563.990334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408564.127068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408564.272327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408564.387494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408564.525966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408564.655670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408564.780931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408564.913911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408565.034128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408565.165641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408565.285286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408565.430476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408565.536538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408565.669674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408565.793098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408565.917723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408566.041113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408566.174074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408566.293600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408566.438720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408566.558970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408566.681603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408566.816928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408567.046874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408567.202788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408567.345182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408567.474952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408567.617682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408567.726384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408567.859609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408567.983868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408568.121301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408568.243891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408568.386586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408568.519922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408568.647877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408568.774889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408568.908930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408569.026399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408569.164294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408569.275597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408569.413443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408569.538025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408569.662984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408569.787176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408569.912057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408570.034731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408570.166930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408570.287598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408570.414976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408570.552506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408570.667298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408570.781989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408570.914251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408571.038219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408571.167044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408571.293884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408571.417493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408571.545740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408571.672691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408571.797665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408571.937199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408572.058927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408572.222809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408572.348349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408572.481959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408572.600773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408572.730505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408572.858001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408572.977615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408573.104277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408573.241796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408573.368598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408573.491655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408573.630667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408573.747479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408573.890888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408574.042001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408574.153971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408574.280680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408574.407263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408574.533581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408574.655262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408574.780931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408574.906811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408575.053175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408575.161140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408575.293103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408575.411940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408575.541695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408575.668543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408575.801964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408575.921987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408576.068248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408576.186642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408576.309002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408576.449504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408576.586771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408576.706017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408576.832808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408576.959499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408577.088030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408577.213027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408577.341267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408577.466894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408577.598648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408577.742774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408577.852744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408577.976849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408578.117862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408578.241065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408578.389149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408578.513515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408578.647707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408578.778575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408578.912301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408579.033872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408579.161153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408579.283878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408579.430777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408579.543510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408579.678754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408579.811295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408579.953443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408580.098728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408580.219641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408580.350800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408580.483190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408580.611522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408580.733045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408580.857602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408580.992000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408581.135706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408581.260556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408581.385073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408581.516438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408581.641872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408581.790077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408581.917907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408582.053707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408582.178988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408582.309731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408582.428302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408582.569773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408582.695436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408582.845661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408582.983239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408583.096690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408583.221188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408583.347570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408583.475379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408583.599181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408583.729744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408583.867661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408583.992517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408584.129111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408584.279833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408584.411076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408584.535501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408584.661700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408584.783559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408584.927340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408585.050111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408585.167186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408585.293373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408585.417956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408585.548623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408585.680712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408585.808882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408585.948770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408586.074585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408586.214792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408586.359822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408586.485180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408586.597137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408586.732014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408586.845583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408586.978147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408587.100909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408587.231405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408587.356702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408587.491611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408587.643740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408587.776233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408587.908100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408588.027796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408588.157940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408588.287950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408588.410932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408588.541946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408588.665852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408588.789515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408588.928148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408589.051500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408589.191444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408589.305089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408589.450813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408589.559906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408589.701951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408589.840801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408589.967702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408590.095563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408590.220747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408590.347744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408590.473132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408590.616884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408590.741366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408590.845425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408590.977329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408591.104094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408591.242254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408591.379055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408591.499046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408591.633684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408591.760606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408591.898862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408592.029866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408592.159834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408592.278377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408592.425712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408592.534818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408592.663227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408592.793983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408592.923619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408593.055266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408593.188535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408593.325292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408593.453699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408593.594195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408593.714550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408593.850259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408593.971987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408594.089099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408594.218497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408594.340270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408594.477628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408594.603502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408594.730934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408594.856683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408594.982625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408595.107105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408595.241502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408595.365686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408595.499463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408595.657190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408595.791689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408595.919066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408596.038819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408596.160443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408596.288085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408596.408339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408596.534087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408596.662345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408596.777336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408596.908186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408597.037414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408597.176334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408597.287466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408597.414302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408597.553942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408597.681209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408597.796079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408597.926832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408598.051851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408598.185993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408598.333093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408598.445944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408598.578289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408598.708025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408598.843871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408598.974604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408599.095880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408599.211890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408599.344072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408599.473639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408599.602349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408599.723855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408599.858985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408599.988720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408600.106418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408600.229739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408600.357652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408600.493218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408600.616989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408600.748951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408600.904218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408601.029812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408601.181126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408601.291790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408601.418586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408601.551017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408601.679579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408601.812957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408601.943378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408602.069485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408602.204451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408602.341075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408602.465562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408602.594684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408602.725920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408602.852103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408602.975795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408603.099782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408603.225268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408603.367015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408603.475993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408603.602657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408603.731620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408603.866549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408603.996388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408604.127644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408604.242730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408604.381182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408604.521714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408604.648191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408604.780537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408604.910987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408605.035915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408605.166086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408605.284691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408605.427285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408605.534564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408605.663515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408605.787436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408605.911510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408606.036407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408606.163176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408606.288079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408606.428123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408606.542083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408606.675267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408606.804481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408606.937925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408607.076659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408607.214617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408607.346895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408607.467486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408607.600050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408607.717085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408607.850574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408607.973981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408608.105207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408608.229885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408608.369816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408608.493531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408608.623872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408608.761345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408608.905237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408609.026998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408609.166111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408609.283131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408609.410110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408609.532652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408609.661327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408609.784847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408609.927999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408610.036567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408610.183505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408610.302295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408610.419069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408610.545130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408610.672503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408610.802402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408610.930264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408611.066350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408611.201806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408611.337933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408611.460374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408611.593947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408611.728908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408611.867798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408611.991006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408612.113319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408612.258631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408612.381335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408612.511971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408612.652455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408612.775403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408612.904707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408613.029107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408613.161109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408613.291213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408613.430475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408613.538611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408613.664263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408613.793522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408613.931482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408614.053550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408614.179021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408614.327258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408614.449673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408614.605009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408614.723875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408614.856144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408614.989064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408615.114962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408615.250151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408615.385668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408615.516809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408615.640960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408615.769010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408615.896268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408616.025955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408616.151180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408616.273132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408616.409007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408616.533875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408616.668969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408616.775182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408616.912215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408617.038610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408617.161119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408617.280918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408617.425129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408617.539736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408617.662671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408617.790345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408617.920931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408618.052642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408618.180451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408618.322787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408618.446314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408618.585002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408618.706406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408618.843804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408618.977897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408619.090740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408619.219810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408619.344698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408619.471192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408619.595627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408619.723878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408619.852605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408619.976211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408620.103414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408620.254522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408620.392040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408620.514921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408620.649748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408620.787766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408620.905953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408621.031946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408621.153683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408621.286628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408621.415293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408621.545760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408621.678184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408621.805764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408621.934574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408622.075758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408622.203912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408622.330036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408622.455855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408622.584125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408622.714928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408622.843779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408622.967500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408623.092350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408623.214577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408623.346292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408623.475356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408623.594879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408623.722307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408623.851498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408623.974046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408624.101183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408624.239697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408624.354240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408624.487305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408624.608573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408624.754631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408624.865748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408625.009771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408625.153327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408625.275001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408625.406110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408625.522399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408625.661320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408625.784213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408625.911974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408626.052217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408626.167869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408626.300402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408626.421829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408626.551063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408626.676573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408626.805583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408626.949825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408627.077318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408627.207434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408627.339530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408627.468819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408627.589975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408627.716521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408627.845355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408627.968321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408628.093933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408628.222751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408628.344802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408628.468955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408628.601296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408628.730671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408628.845675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408628.970970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408629.094176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408629.231401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408629.341214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408629.472710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408629.601748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408629.722563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408629.840265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408629.972856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408630.102149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408630.226374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408630.349132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408630.474073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408630.599049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408630.726800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408630.853121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408630.991852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408631.122482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408631.264048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408631.395999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408631.531366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408631.660882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408631.780081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408631.920517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408632.036297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408632.157628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408632.284938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408632.409218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408632.534623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408632.661837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408632.784456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408632.909370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408633.051936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408633.161725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408633.288144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408633.412212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408633.536964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408633.660873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408633.787660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408633.915286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408634.040349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408634.165085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408634.291332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408634.415429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408634.571879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408634.676970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408634.815366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408634.935747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408635.085061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408635.212500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408635.343012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408635.464995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408635.594142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408635.712770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408635.840865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408635.979138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408636.094006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408636.216554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408636.348613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408636.468746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408636.601741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408636.721937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408636.851469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408636.978584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408637.096595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408637.223745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408637.343432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408637.489439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408637.605847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408637.729854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408637.870469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408637.989061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408638.122911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408638.246081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408638.388933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408638.519641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408638.653811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408638.782325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408638.909730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408639.052703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408639.161054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408639.288755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408639.418305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408639.536554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408639.672638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408639.799590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408639.924745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408640.053091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408640.183031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408640.311743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408640.462935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408640.602324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408640.733148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408640.844564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408640.966928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408641.099440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408641.221826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408641.361069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408641.481931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408641.598331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408641.738774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408641.864085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408641.997516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408642.126579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408642.278367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408642.398945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408642.517837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408642.644665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408642.780722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408642.897804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408643.030996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408643.145857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408643.280591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408643.397763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408643.529695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408643.668523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408643.784769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408643.910386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408644.042342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408644.170403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408644.302360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408644.427583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408644.571138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408644.695903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408644.823734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408644.962680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408645.094694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408645.220289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408645.346480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408645.488190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408645.597233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408645.733928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408645.846601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408645.971995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408646.101883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408646.219371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408646.357094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408646.473705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408646.610903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408646.737931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408646.854619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408646.980685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408647.112395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408647.242918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408647.387388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408647.503788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408647.652615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408647.780280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408647.907094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408648.032755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408648.160095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408648.281982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408648.408411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408648.539511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408648.677564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408648.799532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408648.945152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408649.081607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408649.217018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408649.338104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408649.467256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408649.584277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408649.716320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408649.838769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408649.975715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408650.095297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408650.232931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408650.362564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408650.476798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408650.602963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408650.734046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408650.864234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408651.010901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408651.138776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408651.267753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408651.407016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408651.529960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408651.649970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408651.775991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408651.908331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408652.033070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408652.158995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408652.286339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408652.417981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408652.532479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408652.660576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408652.787139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408652.912537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408653.038360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408653.164680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408653.291900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408653.415230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408653.545501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408653.667910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408653.803255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408653.931005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408654.053746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408654.196378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408654.327800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408654.460338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408654.598084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408654.715395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408654.845293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408654.974588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408655.108194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408655.238754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408655.352934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408655.476538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408655.605655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408655.744153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408655.882092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408656.012630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408656.140213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408656.275972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408656.400045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408656.526128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408656.656474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408656.782498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408656.910484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408657.035727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408657.165718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408657.292081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408657.405953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408657.551198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408657.665627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408657.803353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408657.917554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408658.056033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408658.176134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408658.302452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408658.450348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408658.577074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408658.716205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408658.840860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408658.966888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408659.092342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408659.223815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408659.342020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408659.471003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408659.597259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408659.722203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408659.850368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408659.993303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408660.113204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408660.247732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408660.371902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408660.519205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408660.646330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408660.780321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408660.906924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408661.047663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408661.159192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408661.282434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408661.406606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408661.535681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408661.663864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408661.785553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408661.910223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408662.038633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408662.167093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408662.295785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408662.431573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408662.573970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408662.709619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408662.841619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408662.963951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408663.094709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408663.220918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408663.351024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408663.476183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408663.601194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408663.739194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408663.853951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408663.988052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408664.112264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408664.257975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408664.380984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408664.510231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408664.647505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408664.771075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408664.916446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408665.037691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408665.167498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408665.289435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408665.421221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408665.549345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408665.683851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408665.824075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408665.945906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408666.066082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408666.195149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408666.336256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408666.493887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408666.599116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408666.728836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408666.863603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408666.990531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408667.132420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408667.260330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408667.400755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408667.526391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408667.658727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408667.776629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408667.904647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408668.038876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408668.166234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408668.288671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408668.420511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408668.554535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408668.666383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408668.797173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408668.939227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408669.080148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408669.207006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408669.336921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408669.467222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408669.583195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408669.712709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408669.840254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408669.975294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408670.086256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408670.207972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408670.346767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408670.468999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408670.587281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408670.714594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408670.839209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408670.970915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408671.117112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408671.230099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408671.361060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408671.491783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408671.649295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408671.771215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408671.905672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408672.031608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408672.152637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408672.284173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408672.417855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408672.544560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408672.681948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408672.802870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408672.932315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408673.070171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408673.211884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408673.341001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408673.489061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408673.599537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408673.728579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408673.877789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408673.980264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408674.111984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408674.249810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408674.386204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408674.512884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408674.645990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408674.781451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408674.917027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408675.039965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408675.155361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408675.286180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408675.426288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408675.532863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408675.662798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408675.798468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408675.914996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408676.053021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408676.176428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408676.322077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408676.449064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408676.581674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408676.710373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408676.826265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408676.972127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408677.091709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408677.223625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408677.354859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408677.476065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408677.605278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408677.732033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408677.863358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408677.978524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408678.128550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408678.257986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408678.381978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408678.519295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408678.650442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408678.776940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408678.907209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408679.023375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408679.150865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408679.276434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408679.404170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408679.525512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408679.667098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408679.778406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408679.912817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408680.032818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408680.157186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408680.286426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408680.416555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408680.529654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408680.666465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408680.791335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408680.920004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408681.043897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408681.172648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408681.294834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408681.424865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408681.566051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408681.691503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408681.946841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408682.243170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408682.388745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408682.549680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408682.734818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408682.896557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408683.092858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408683.240854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408683.412354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408683.599633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408683.736929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408683.894047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408684.079398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408684.246299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408684.410098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408684.615298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408684.735193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408684.864739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408684.992501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408685.124890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408685.260785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408685.391674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408685.526320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408685.655661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408685.779139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408685.910431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408686.035181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408686.162085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408686.287109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408686.448217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408686.550218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408686.689790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408686.823206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408686.942117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408687.074799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408687.201618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408687.324904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408687.446709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408687.604478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408687.838555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408687.967748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408688.084250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408688.206327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408688.331610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408688.452347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408688.586884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408688.722070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408688.843495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408688.971758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408689.102301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408689.222806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408689.356447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408689.471900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408689.618998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408689.725843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408689.855187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408689.976394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408690.111427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408690.238630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408690.378599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408690.492289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408690.624286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408690.758330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408690.900158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408691.017497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408691.153635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408691.271619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408691.402624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408691.527969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408691.677827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408691.783689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408691.908468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408692.043705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408692.176854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408692.299662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408692.432052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408692.552176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408692.679845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408692.816712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408692.971031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408693.091947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408693.217313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408693.343182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408693.467427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408693.592999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408693.722313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408693.842441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408693.976158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408694.092204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408694.224385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408694.350276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408694.483642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408694.619728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408694.762808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408694.888709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408695.016484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408695.140172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408695.275855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408695.400744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408695.533884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408695.655190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408695.780499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408695.923685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408696.050299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408696.165870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408696.300223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408696.449455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408696.555145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408696.697366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408696.810002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408696.941546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408697.084769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408697.212001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408697.344348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408697.461747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408697.597665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408697.718848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408697.849923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408697.979808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408698.114760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408698.219237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408698.348144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408698.464556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408698.596769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408698.722410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408698.862910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408698.973744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408699.102578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408699.225857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408699.364648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408699.484107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408699.622848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408699.762460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408699.892290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408700.030098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408700.148809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408700.274560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408700.408153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408700.533890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408700.659591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408700.781610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408700.912931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408701.035702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408701.161273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408701.292160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408701.421736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408701.545126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408701.700202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408701.826557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408701.959543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408702.090893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408702.220202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408702.341522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408702.464697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408702.595839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408702.724149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408702.857000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408702.972721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408703.090913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408703.218104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408703.343126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408703.467511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408703.625641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408703.736535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408703.870346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408704.013309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408704.136234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408704.282861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408704.411333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408704.535770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408704.660367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408704.790972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408704.928594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408705.043632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408705.186452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408705.301813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408705.449209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408705.560941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408705.702522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408705.827243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408705.961175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408706.094575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408706.210824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408706.338016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408706.461998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408706.589161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408706.714954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408706.834761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408706.963682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408707.091140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408707.214614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408707.345215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408707.471289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408707.614579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408707.729584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408707.858878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408707.989806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408708.114399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408708.250163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408708.373228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408708.512866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408708.644656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408708.773049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408708.901251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408709.027671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408709.151012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408709.281899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408709.406899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408709.528451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408709.659746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408709.813842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408709.928110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408710.046204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408710.177672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408710.306707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408710.445791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408710.584218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408710.716583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408710.830161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408710.962864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408711.087654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408711.221724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408711.343318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408711.474440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408711.602019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408711.722280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408711.850772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408711.975078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408712.106068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408712.239067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408712.385838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408712.504167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408712.634417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408712.767583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408712.898478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408713.020553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408713.146696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408713.278872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408713.407371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408713.536176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408713.663770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408713.802099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408713.927595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408714.069880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408714.203175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408714.309983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408714.456170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408714.588260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408714.707682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408714.844386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408714.977887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408715.091957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408715.216444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408715.345117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408715.471251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408715.600501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408715.733263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408715.871724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408716.000383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408716.135818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408716.271384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408716.408252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408716.526901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408716.655075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408716.779168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408716.919207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408717.025949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408717.158711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408717.279052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408717.405963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408717.547643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408717.663498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408717.799205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408717.902864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408718.029869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408718.159801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408718.305818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408718.416665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408718.550221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408718.679084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408718.812858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408718.956416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408719.085323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408719.211211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408719.331598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408719.453942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408719.583089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408719.713849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408719.843033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408719.962420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408720.091779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408720.215544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408720.345926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408720.473012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408720.598397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408720.734550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408720.860917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408720.992979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408721.123904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408721.259890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408721.386677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408721.507009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408721.641522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408721.771542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408721.907071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408722.040717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408722.158878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408722.282968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408722.408687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408722.540607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408722.674151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408722.791798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408722.937883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408723.073739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408723.194565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408723.335547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408723.452028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408723.590086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408723.706318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408723.860681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408723.968641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408724.100726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408724.218630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408724.343158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408724.472814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408724.595927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408724.721988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408724.846386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408724.965008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408725.103287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408725.216614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408725.338049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408725.484504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408725.597767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408725.735418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408725.848358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408725.973610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408726.109123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408726.221572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408726.369363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408726.472864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408726.600797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408726.724023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408726.850388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408726.976610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408727.110072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408727.249118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408727.383338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408727.518030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408727.654824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408727.779482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408727.930381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408728.037781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408728.164003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408728.290463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408728.416050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408728.548832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408728.684880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408728.820743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408728.948256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408729.082824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408729.209919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408729.336148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408729.472681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408729.586269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408729.713821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408729.838541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408729.985495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408730.093711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408730.222069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408730.343891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408730.470345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408730.593691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408730.720002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408730.851569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408730.970404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408731.111528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408731.218081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408731.360333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408731.473209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408731.595974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408731.737599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408731.874221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408732.011887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408732.135138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408732.272104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408732.402514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408732.528604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408732.650553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408732.769543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408732.895314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408733.019607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408733.149706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408733.276160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408733.398948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408733.532017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408733.658960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408733.778285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408733.909149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408734.031100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408734.159621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408734.300625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408734.429369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408734.564102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408734.690412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408734.813749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408734.940134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408735.066867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408735.208742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408735.335419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408735.459420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408735.593271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408735.717682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408735.845987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408735.982491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408736.099360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408736.223827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408736.345730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408736.469350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408736.599285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408736.736273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408736.848834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408736.977774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408737.120967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408737.234048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408737.350742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408737.490537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408737.615993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408737.759284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408737.869658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408738.002858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408738.142641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408738.277948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408738.405366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408738.527711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408738.664109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408738.789990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408738.905985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408739.020314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408739.151757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408739.278132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408739.402417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408739.522293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408739.650016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408739.767837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408739.903539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408740.030610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408740.159109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408740.280104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408740.408336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408740.547122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408740.662603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408740.785027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408740.914187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408741.035706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408741.182222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408741.291234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408741.421625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408741.537421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408741.672512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408741.798429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408741.938714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408742.077478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408742.229233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408742.338692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408742.470654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408742.592348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408742.719917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408742.841946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408742.974702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408743.092299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408743.219217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408743.347879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408743.476173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408743.609886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408743.726391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408743.849560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408743.994256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408744.110542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408744.239420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408744.382648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408744.513977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408744.646601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408744.790748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408744.893596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408745.031051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408745.153673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408745.278469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408745.403638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408745.542955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408745.655720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408745.784064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408745.920156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408746.038813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408746.178726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408746.291337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408746.420920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408746.549201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408746.678914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408746.823985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408746.952767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408747.086394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408747.209030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408747.334080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408747.457616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408747.586060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408747.719314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408747.846818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408747.973452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408748.104832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408748.239463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408748.366720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408748.488752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408748.624244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408748.771262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408748.900036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408749.025112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408749.142786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408749.271374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408749.401583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408749.527084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408749.652100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408749.774815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408749.898160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408750.020766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408750.153144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408750.269951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408750.408185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408750.533712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408750.648759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408750.777358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408750.908936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408751.034842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408751.156875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408751.284766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408751.416213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408751.527326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408751.660736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408751.781828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408751.910457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408752.039500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408752.167142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408752.295371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408752.423293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408752.547858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408752.697515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408752.821569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408752.956533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408753.082966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408753.206074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408753.333995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408753.465531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408753.598795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408753.733632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408753.859202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408753.994082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408754.108377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408754.240273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408754.364419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408754.502559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408754.635324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408754.763046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408754.892913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408755.030972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408755.148197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408755.280426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408755.403097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408755.533583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408755.654767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408755.778272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408755.910153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408756.033133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408756.162576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408756.280100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408756.403191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408756.533806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408756.663016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408756.806135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408756.914502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408757.055530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408757.173589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408757.324270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408757.435150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408757.586695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408757.711704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408757.842357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408757.968224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408758.092800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408758.211834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408758.339032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408758.461829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408758.594885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408758.720077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408758.858011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408758.973476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408759.100832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408759.222747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408759.347164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408759.475364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408759.639255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408759.753715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408759.887597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408760.030612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408760.155484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408760.280125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408760.405028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408760.536273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408760.660962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408760.780385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408760.914242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408761.034185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408761.157820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408761.285033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408761.421614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408761.533522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408761.664163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408761.798637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408761.940956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408762.073090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408762.195735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408762.335138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408762.467103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408762.593115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408762.719858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408762.841022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408762.970343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408763.093431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408763.225525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408763.341699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408763.472426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408763.588832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408763.719536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408763.847360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408763.978284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408764.110722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408764.250012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408764.378842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408764.516703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408764.641335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408764.774039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408764.907833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408765.028533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408765.149874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408765.279799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408765.408004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408765.528363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408765.649059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408765.781976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408765.902591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408766.031589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408766.161538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408766.289142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408766.417841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408766.548476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408766.680679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408766.806280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408766.937013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408767.073344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408767.201966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408767.336041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408767.461133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408767.592624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408767.734072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408767.854143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408767.984207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408768.119322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408768.255455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408768.367113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408768.505882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408768.631414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408768.791385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408768.919897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408769.024193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408769.153693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408769.274015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408769.404853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408769.528486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408769.654933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408769.779458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408769.908132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408770.033923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408770.164654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408770.289089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408770.429605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408770.556733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408770.693133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408770.815752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408770.958332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408771.088486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408771.237784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408771.357426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408771.474175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408771.600204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408771.725873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408771.849349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408771.976943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408772.110786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408772.256102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408772.378652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408772.521580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408772.649002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408772.778145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408772.894251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408773.031033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408773.156328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408773.278060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408773.405153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408773.528630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408773.657033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408773.775754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408773.904174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408774.035622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408774.151328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408774.281101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408774.404453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408774.532097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408774.653784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408774.783419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408774.907171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408775.032972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408775.149249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408775.283286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408775.405560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408775.540481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408775.675998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408775.793916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408775.913974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408776.080385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408776.180173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408776.314247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408776.452399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408776.591209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408776.710739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408776.844601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408776.973126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408777.086364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408777.216829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408777.342708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408777.459002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408777.591788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408777.715852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408777.843768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408777.972404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408778.106487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408778.228650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408778.359175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408778.485919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408778.627877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408778.743707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408778.894212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408779.020118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408779.153957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408779.284124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408779.429237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408779.548920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408779.682453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408779.817628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408779.946366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408780.089566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408780.216997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408780.346065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408780.467638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408780.610062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408780.737015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408780.854559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408780.981314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408781.109021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408781.251363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408781.359323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408781.501001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408781.641311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408781.756129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408781.892910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408782.033257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408782.153304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408782.282150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408782.420248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408782.526023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408782.650615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408782.779558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408782.901473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408783.031533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408783.155931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408783.278711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408783.407114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408783.549113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408783.664847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408783.798220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408783.915928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408784.047960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408784.171516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408784.303164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408784.444800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408784.570721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408784.709084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408784.817748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408784.954231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408785.088103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408785.206458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408785.334571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408785.457076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408785.608093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408785.709201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408785.860507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408785.966631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408786.098663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408786.330629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408786.577178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408786.706176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408786.824652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408786.956646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408787.091854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408787.220166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408787.342626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408787.459302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408787.589334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408787.718997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408787.849760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408787.974879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408788.099973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408788.227451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408788.351827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408788.500557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408788.613311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408788.733801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408788.879387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408789.008439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408789.140141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408789.265679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408789.396616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408789.514938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408789.645143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408789.772108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408789.900917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408790.026828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408790.151968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408790.293661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408790.407269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408790.541374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408790.659628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408790.780790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408790.905467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408791.034236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408791.173814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408791.299408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408791.423836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408791.568331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408791.696980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408791.833768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408791.975066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408792.100433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408792.234389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408792.373700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408792.508923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408792.640720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408792.762588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408792.895458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408793.028355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408793.159745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408793.274672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408793.401626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408793.540901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408793.673219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408793.795583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408793.911052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408794.039707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408794.168802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408794.295814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408794.424283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408794.550044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408794.676173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408794.819906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408794.954616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408795.079173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408795.204247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408795.335029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408795.466300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408795.592126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408795.715492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408795.836463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408795.968508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408796.113046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408796.225008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408796.360453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408796.476718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408796.610928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408796.748603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408796.879072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408797.012420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408797.132917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408797.274061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408797.410458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408797.525069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408797.653735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408797.778975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408797.906758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408798.030815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408798.162212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408798.283808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408798.415821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408798.544546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408798.672782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408798.806120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408798.936384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408799.081514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408799.199843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408799.333674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408799.462987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408799.585762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408799.722774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408799.843243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408799.965466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408800.096132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408800.234366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408800.361607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408800.488783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408800.626436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408800.761636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408800.906214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408801.022194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408801.149872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408801.283562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408801.404855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408801.533106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408801.658724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408801.787586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408801.911482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408802.040706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408802.181750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408802.306956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408802.445009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408802.570845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408802.942811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408803.108580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408803.287175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408803.449518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408803.634960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408803.796677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408804.004546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408804.166268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408804.316284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408804.532505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408804.663592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408804.841695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408805.010188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408805.164741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408805.344887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408805.573805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408805.706417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408805.840446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408805.966580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408806.096482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408806.216911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408806.338579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408806.461723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408806.595856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408806.718367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408806.842722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408806.967874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408807.094075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408807.219875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408807.341014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408807.472960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408807.587164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408807.717163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408807.851351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408807.983826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408808.103692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408808.226332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408808.361858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408808.498874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408808.709825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408808.863074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408808.991816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408809.127969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408809.241816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408809.380349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408809.511396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408809.648580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408809.794613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408809.900620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408810.032735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408810.154871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408810.281349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408810.407685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408810.538028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408810.656100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408810.778333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408810.903068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408811.048251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408811.159184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408811.303512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408811.434847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408811.545275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408811.679151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408811.806355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408811.945508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408812.079731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408812.216614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408812.345603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408812.469811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408812.597751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408812.720157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408812.851154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408812.975116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408813.116263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408813.241973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408813.367339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408813.506595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408813.641897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408813.775013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408813.918241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408814.043909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408814.176674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408814.318791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408814.426546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408814.586423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408814.697855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408814.822999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408814.956670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408815.082376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408815.208092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408815.331508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408815.459806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408815.593979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408815.719293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408815.838763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408815.978812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408816.109368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408816.230754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408816.365080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408816.505442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408816.634745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408816.776898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408816.888767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408817.024845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408817.153090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408817.279141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408817.404707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408817.522128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408817.651450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408817.782152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408817.899986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408818.026067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408818.154937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408818.280682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408818.403643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408818.528297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408818.660087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408818.786149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408818.909495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408819.035067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408819.159031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408819.285466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408819.421824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408819.547852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408819.679417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408819.818458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408819.945260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408820.084252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408820.209779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408820.344470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408820.464047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408820.592714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408820.715296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408820.841771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408820.967053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408821.090778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408821.211683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408821.353151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408821.464213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408821.593977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408821.750777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408821.871834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408822.007859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408822.133243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408822.271448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408822.390686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408822.515081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408822.645155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408822.771777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408822.900079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408823.024475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408823.153940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408823.275715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408823.407885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408823.532603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408823.659825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408823.782021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408823.906378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408824.036718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408824.162118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408824.301012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408824.414142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408824.549937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408824.684586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408824.801228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408824.924034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408825.053501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408825.202848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408825.330805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408825.452093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408825.574685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408825.710171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408825.829137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408825.956985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408826.090213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408826.219538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408826.347044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408826.477637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408826.614822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408826.734016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408826.863664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408827.005316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408827.138892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408827.263260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408827.387273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408827.519524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408827.661576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408827.788488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408827.909682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408828.033049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408828.164314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408828.287846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408828.410528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408828.546848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408828.671782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408828.804756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408828.957936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408829.070434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408829.200562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408829.329802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408829.460206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408829.594454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408829.707818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408829.848499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408829.972938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408830.111549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408830.242303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408830.378838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408830.532242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408830.654773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408830.773806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408830.900880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408831.024469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408831.150685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408831.279953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408831.403137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408831.519938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408831.660622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408831.773252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408831.898705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408832.026304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408832.148816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408832.282664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408832.405994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408832.530031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408832.672765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408832.780958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408832.912730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408833.048246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408833.164413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408833.295594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408833.414395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408833.545201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408833.678752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408833.795475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408833.943256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408834.081841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408834.206647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408834.331472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408834.467576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408834.602141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408834.725057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408834.848853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408834.975136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408835.113152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408835.238723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408835.357779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408835.503928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408835.638202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408835.773862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408835.889066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408836.021426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408836.144043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408836.274122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408836.399068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408836.530124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408836.651593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408836.779044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408836.908126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408837.031187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408837.172613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408837.290796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408837.412552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408837.561592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408837.673699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408837.815577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408837.939694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408838.068836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408838.203758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408838.335581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408838.469069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408838.609858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408838.720778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408838.837717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408838.972241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408839.098199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408839.232867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408839.361317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408839.496557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408839.631865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408839.773970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408839.898936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408840.030983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408840.155571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408840.280656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408840.410870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408840.545962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408840.679952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408840.818082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408840.946742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408841.082049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408841.216953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408841.349826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408841.465694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408841.592333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408841.720253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408841.843591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408841.972866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408842.097233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408842.226699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408842.355237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408842.497021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408842.641340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408842.765650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408842.896782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408843.023128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408843.158583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408843.277891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408843.400788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408843.545327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408843.656820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408843.802385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408843.905334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408844.032710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408844.161507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408844.289351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408844.413714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408844.539716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408844.677311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408844.807223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408844.939096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408845.056698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408845.208339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408845.329576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408845.460935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408845.585495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408845.709136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408845.839741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408845.974240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408846.106703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408846.218431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408846.344374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408846.475417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408846.593601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408846.719045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408846.849319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408846.973437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408847.099008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408847.243155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408847.361645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408847.484611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408847.626737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408847.752839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408847.900354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408848.020510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408848.151063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408848.275513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408848.397912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408848.522469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408848.652544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408848.794866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408848.911301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408849.032098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408849.170670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408849.281122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408849.406814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408849.531363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408849.657164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408849.782857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408849.935881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408850.039515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408850.172935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408850.295735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408850.433254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408850.555952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408850.695335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408850.825047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408850.954395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408851.084029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408851.215782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408851.338616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408851.457355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408851.580275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408851.720483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408851.844200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408851.971254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408852.086752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408852.215548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408852.343677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408852.468456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408852.592260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408852.712382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408852.844828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408852.966829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408853.096927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408853.217206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408853.339277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408853.483444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408853.587184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408853.709857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408853.845427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408853.981333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408854.111171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408854.230827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408854.370238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408854.488634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408854.616880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408854.756699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408854.884805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408855.005572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408855.141063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408855.274774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408855.398494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408855.544415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408855.653992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408855.778790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408855.904150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408856.031263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408856.154509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408856.281856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408856.407392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408856.539077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408856.657633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408856.788690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408856.914983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408857.038797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408857.178111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408857.314876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408857.444000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408857.570056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408857.694884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408857.836813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408857.962404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408858.095328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408858.218997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408858.348678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408858.477169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408858.614598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408858.732924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408858.882845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408859.000657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408859.135009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408859.258587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408859.399050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408859.527489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408859.651740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408859.777687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408859.921256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408860.032735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408860.168308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408860.285532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408860.421821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408860.543085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408860.688950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408860.815144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408860.952185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408861.070184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408861.218293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408861.335554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408861.455678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408861.586301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408861.713536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408861.840495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408861.963299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408862.089227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408862.222830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408862.361264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408862.469260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408862.606425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408862.719275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408862.842130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408862.966364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408863.091385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408863.238670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408863.349990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408863.483393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408863.611431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408863.746629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408863.878529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408864.009803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408864.139015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408864.273032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408864.396043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408864.527836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408864.641080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408864.765072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408864.899476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408865.030491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408865.150545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408865.281526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408865.408470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408865.555226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408865.668101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408865.801549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408865.939862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408866.078846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408866.207016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408866.323520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408866.445074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408866.571563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408866.700057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408866.835207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408866.961911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408867.085311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408867.226605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408867.338217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408867.462241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408867.595858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408867.710294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408867.844079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408867.965550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408868.094149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408868.219317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408868.342973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408868.466197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408868.586823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408868.731115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408868.844277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408868.961113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408869.094373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408869.220913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408869.373579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408869.484546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408869.609718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408869.740845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408869.875385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408870.006143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408870.139437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408870.267637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408870.389249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408870.514404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408870.648971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408870.786524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408870.905498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408871.029728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408871.160031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408871.277751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408871.405938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408871.526780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408871.648791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408871.777019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408871.906268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408872.028872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408872.172129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408872.283595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408872.410616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408872.533076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408872.660581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408872.786391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408872.918935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408873.052437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408873.189558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408873.321977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408873.476660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408873.576391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408873.710111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408873.854914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408873.982156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408874.092460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408874.218735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408874.335321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408874.465267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408874.599314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408874.716825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408874.832683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408874.981332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408875.091491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408875.216008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408875.346324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408875.467015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408875.595905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408875.731338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408875.843071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408875.975366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408876.106047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408876.231890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408876.376543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408876.496907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408876.643447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408876.763268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408876.898553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408877.031869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408877.160991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408877.277003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408877.398499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408877.533805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408877.657218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408877.786281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408877.913719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408878.041561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408878.181072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408878.319195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408878.441682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408878.579607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408878.701572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408878.831623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408878.963000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408879.091110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408879.213291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408879.340089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408879.461146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408879.591931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408879.729363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408879.855905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408879.978678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408880.105952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408880.239433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408880.386337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408880.509717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408880.644531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408880.772855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408880.903452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408881.032232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408881.148905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408881.280973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408881.416158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408881.519732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408881.653726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408881.816777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408881.934501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408882.063876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408882.196153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408882.328758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408882.459003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408882.581502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408882.712670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408882.839776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408882.970806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408883.087813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408883.215332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408883.337188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408883.459250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408883.582467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408883.716817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408883.839640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408883.990685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408884.125139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408884.254923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408884.381206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408884.523391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408884.645561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408884.771702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408884.899499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408885.028861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408885.147421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408885.274830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408885.399606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408885.522141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408885.639461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408885.765944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408885.906544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408886.028584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408886.146712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408886.281065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408886.408423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408886.541329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408886.661915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408886.793289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408886.928918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408887.070844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408887.191828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408887.326692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408887.450886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408887.586120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408887.713169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408887.845487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408887.968845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408888.091691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408888.213885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408888.341943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408888.472885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408888.593678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408888.709208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408888.836275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408888.962259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408889.120251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408889.230801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408889.360677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408889.495209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408889.620569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408889.776569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408889.891692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408890.022140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408890.154181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408890.284002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408890.432682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408890.536695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408890.694314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408890.797790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408890.924793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408891.062038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408891.201087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408891.322692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408891.454812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408891.582905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408891.723791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408891.839162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408891.968676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408892.090071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408892.218615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408892.337892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408892.465750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408892.585275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408892.717485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408892.844347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408892.968700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408893.092889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408893.216687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408893.333220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408893.464943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408893.583402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408893.713456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408893.839175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408893.972874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408894.110066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408894.233245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408894.357043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408894.482168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408894.624558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408894.764174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408894.884113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408895.020232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408895.146325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408895.271773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408895.401361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408895.522593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408895.649348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408895.781479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408895.927723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408896.034332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408896.158576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408896.296517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408896.425291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408896.562122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408896.690468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408896.821521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408896.946995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408897.073768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408897.204660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408897.334880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408897.449800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408897.583755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408897.718303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408897.842147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408897.964358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408898.096151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408898.215640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408898.363022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408898.470126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408898.592664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408898.719263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408898.848706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408898.979616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408899.105848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408899.231321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408899.360848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408899.484129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408899.627394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408899.749206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408899.881857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408900.008584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408900.150111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408900.275034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408900.403970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408900.524911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408900.649590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408900.773991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408900.903312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408901.026936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408901.170562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408901.291927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408901.405257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408901.542156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408901.669491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408901.809505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408901.931572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408902.059332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408902.193821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408902.328787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408902.456035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408902.588527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408902.709907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408902.837227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408902.963347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408903.083671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408903.219756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408903.347119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408903.468903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408903.591246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408903.723552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408903.846764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408903.984841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408904.100147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408904.230637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408904.364452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408904.501666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408904.633497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408904.755239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408904.882639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408905.006817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408905.143796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408905.266276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408905.402973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408905.527006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408905.651074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408905.772754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408905.904167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408906.029455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408906.153885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408906.279295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408906.401222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408906.535579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408906.658230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408906.788127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408906.907272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408907.034939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408907.161025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408907.298060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408907.411875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408907.542144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408907.675191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408907.798379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408907.936963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408908.069584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408908.205798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408908.340543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408908.477514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408908.592959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408908.719908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408908.841074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408908.967201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408909.100842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408909.222336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408909.369982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408909.483730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408909.613283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408909.759205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408909.877630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408910.006429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408910.149009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408910.274643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408910.406442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408910.526825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408910.654681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408910.799820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408910.907968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408911.043172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408911.176186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408911.294910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408911.436859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408911.572569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408911.713261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408911.839329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408911.961796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408912.091359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408912.215719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408912.337136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408912.458519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408912.584984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408912.714216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408912.847731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408912.983853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408913.107837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408913.248209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408913.378875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408913.512536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408913.638656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408913.765038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408913.902376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408914.031362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408914.156382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408914.290497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408914.419320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408914.563970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408914.688707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408914.826924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408914.951014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408915.087559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408915.208864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408915.337791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408915.458511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408915.580006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408915.705303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408915.840125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408915.966471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408916.086503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408916.202610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408916.342272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408916.464000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408916.595067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408916.714509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408916.845059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408916.965179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408917.088241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408917.214970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408917.346038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408917.470048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408917.603365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408917.738870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408917.880216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408918.005288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408918.149420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408918.275172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408918.405766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408918.520254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408918.652870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408918.790188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408918.905663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408919.031590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408919.170926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408919.282314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408919.411158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408919.546148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408919.662325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408919.794470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408919.927958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408920.063391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408920.192111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408920.335943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408920.460824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408920.580246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408920.708935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408920.825568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408920.961650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408921.084230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408921.216836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408921.338572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408921.469371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408921.593281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408921.721649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408921.856391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408921.971378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408922.116704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408922.234819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408922.357688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408922.501729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408922.634599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408922.765306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408922.899862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408923.041354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408923.348478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408923.723784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408923.915413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408924.087851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408924.279475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408924.470312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408924.640137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408924.836061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408925.000456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408925.220319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408925.358395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408925.539603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408925.734725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408925.881682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408926.085498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408926.311140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408926.490353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408926.638161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408926.759621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408926.894930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408927.023734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408927.144084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408927.275563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408927.414178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408927.544312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408927.658126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408927.784767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408927.935647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408928.048160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408928.181449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408928.321807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408928.457016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408928.586649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408928.718164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408928.838458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408928.970758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408929.096899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408929.227399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408929.355431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408929.607489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408929.750690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408929.880082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408930.013547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408930.147432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408930.264439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408930.400612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408930.520799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408930.650488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408930.774569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408930.903544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408931.024205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408931.150283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408931.280576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408931.412464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408931.539789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408931.663181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408931.796984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408931.934232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408932.079393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408932.207199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408932.336910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408932.467141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408932.608535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408932.722133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408932.853805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408932.983893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408933.110595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408933.255209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408933.381136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408933.515383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408933.643304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408933.773501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408933.920028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408934.033074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408934.165697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408934.290404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408934.421243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408934.557052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408934.721732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408934.836797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408934.961373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408935.089323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408935.212331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408935.348617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408935.468282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408935.601646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408935.733085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408935.853409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408935.994093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408936.132643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408936.258776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408936.405797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408936.513864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408936.653802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408936.779865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408936.902304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408937.026130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408937.151594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408937.285617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408937.412553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408937.532593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408937.688996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408937.804022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408937.938721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408938.083386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408938.228402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408938.354380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408938.465654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408938.592556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408938.721855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408938.857121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408938.979460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408939.096422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408939.223341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408939.353820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408939.494042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408939.627386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408939.785270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408939.897817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408940.027769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408940.159481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408940.307907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408940.433083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408940.569195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408940.706945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408940.831416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408940.958174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408941.083631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408941.210200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408941.340793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408941.459823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408941.590333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408941.721889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408941.864912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408941.999326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408942.138791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408942.265230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408942.389351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408942.514829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408942.644476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408942.772506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408942.896926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408943.022036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408943.149699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408943.271967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408943.400382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408943.521626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408943.659589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408943.780082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408943.917332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408944.044646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408944.173589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408944.312636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408944.463460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408944.584617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408944.713193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408944.834020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408944.982134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408945.103931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408945.233801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408945.357712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408945.481676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408945.620977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408945.773052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408945.892005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408946.015083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408946.146429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408946.276919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408946.415660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408946.531693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408946.650676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408946.788633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408946.919252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408947.036036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408947.170957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408947.297170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408947.427611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408947.562081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408947.699751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408947.825636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408947.950360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408948.075309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408948.200245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408948.341044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408948.465469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408948.585428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408948.708377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408948.842143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408948.965827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408949.091791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408949.216740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408949.359090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408949.500075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408949.614545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408949.748398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408949.890735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408950.016379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408950.138697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408950.265210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408950.405290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408950.528416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408950.655165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408950.780177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408950.909589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408951.032902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408951.165662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408951.308004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408951.439057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408951.569365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408951.704618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408951.828314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408951.956886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408952.076725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408952.211227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408952.335342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408952.462310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408952.592320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408952.718287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408952.852667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408952.992834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408953.133948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408953.269869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408953.395940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408953.526771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408953.645879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408953.775357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408953.902558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408954.023242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408954.150390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408954.276034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408954.403216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408954.530769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408954.667927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408954.785765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408954.919707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408955.048422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408955.170102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408955.305027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408955.437923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408955.567185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408955.712327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408955.846082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408955.971148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408956.095882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408956.219374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408956.345051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408956.471296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408956.626851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408956.729714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408956.875585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408957.003375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408957.136823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408957.272043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408957.397045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408957.520848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408957.652888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408957.783957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408957.907456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408958.066935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408958.187378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408958.320609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408958.460094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408958.579653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408958.711210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408958.835231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408958.962992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408959.102702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408959.229430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408959.338381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408959.467763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408959.601339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408959.723450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408959.862394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408959.985282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408960.115423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408960.237183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408960.369849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408960.523315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408960.646326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408960.772252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408960.901283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408961.029567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408961.150624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408961.293681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408961.404755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408961.532148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408961.656921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408961.783902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408961.916250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408962.047716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408962.199758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408962.314870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408962.452229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408962.602441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408962.711967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408962.860907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408962.969593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408963.096699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408963.222172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408963.345207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408963.470683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408963.596918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408963.736171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408963.851563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408963.982529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408964.104202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408964.247208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408964.385015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408964.516752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408964.634527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408964.768225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408964.903983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408965.041232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408965.150687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408965.279487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408965.413705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408965.542912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408965.657435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408965.781138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408965.906396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408966.033711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408966.171308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408966.302442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408966.430243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408966.562533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408966.707293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408966.825932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408966.958919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408967.083262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408967.209018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408967.324175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408967.454327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408967.581768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408967.712319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408967.850688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408967.963383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408968.091685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408968.244351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408968.356311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408968.499440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408968.625327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408968.756295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408968.884463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408969.018722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408969.147011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408969.271794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408969.397028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408969.524686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408969.654989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408969.777105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408969.914699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408970.027923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408970.145469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408970.275427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408970.404410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408970.523052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408970.652594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408970.777008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408970.912698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408971.043149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408971.155247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408971.288344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408971.410098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408971.533134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408971.689716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408971.830678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408971.961760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408972.083749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408972.228057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408972.335796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408972.457559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408972.581439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408972.699736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408972.830460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408972.950566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408973.078157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408973.210159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408973.342203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408973.467467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408973.597470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408973.710486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408973.848627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408973.977453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408974.104145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408974.235556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408974.363159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408974.502745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408974.630555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408974.768544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408974.893199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408975.013576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408975.145429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408975.273319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408975.401299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408975.528644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408975.653159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408975.783198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408975.907721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408976.043609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408976.175291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408976.301684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408976.426800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408976.563033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408976.702327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408976.825292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408976.958964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408977.083319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408977.211437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408977.333780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408977.465332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408977.587353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408977.720217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408977.843493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408977.983460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408978.097526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408978.230082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408978.364949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408978.503447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408978.632226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408978.776730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408978.897830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408979.016890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408979.164634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408979.276726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408979.401068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408979.524563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408979.656248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408979.780606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408979.910670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408980.044113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408980.187444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408980.335210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408980.458125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408980.585035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408980.701737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408980.833207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408980.962239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408981.088861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408981.220841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408981.344270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408981.462305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408981.589179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408981.728000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408981.832885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408981.961730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408982.087413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408982.215989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408982.340835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408982.462136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408982.590678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408982.713421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408982.839024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408982.978728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408983.108408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408983.210797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408983.342278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408983.480402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408983.627257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408983.804838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408983.949445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408984.065864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408984.196752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408984.336464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408984.465096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408984.590353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408984.721418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408984.850204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408984.976094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408985.109910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408985.244509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408985.395955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408985.514848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408985.637369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408985.784515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408985.898328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408986.039236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408986.147928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408986.281741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408986.407298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408986.534148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408986.655499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408986.785763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408986.920739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408987.064041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408987.174012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408987.321284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408987.450390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408987.579710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408987.705724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408987.833554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408987.962601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408988.103679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408988.218648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408988.343974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408988.481253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408988.607680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408988.749270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408988.888886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408989.016847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408989.157673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408989.288163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408989.396404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408989.531884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408989.669013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408989.789249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408989.927789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408990.065120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408990.173146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408990.311910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408990.480702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408990.591033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408990.750600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408990.849959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408990.991386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408991.125216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408991.263670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408991.395284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408991.526816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408991.648823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408991.773487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408991.900579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408992.030519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408992.179116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408992.310806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408992.436199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408992.569095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408992.692006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408992.816126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408992.960357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408993.086328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408993.217671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408993.342331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408993.473569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408993.606505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408993.728554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408993.852137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408993.978099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408994.121749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408994.249765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408994.379559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408994.531200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408994.650431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408994.776486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408994.906841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408995.031611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408995.163993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408995.292372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408995.419732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408995.549598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408995.698633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408995.823770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408995.957952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408996.072061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408996.204935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408996.338786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408996.465822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408996.583958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408996.712489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408996.838171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408996.966279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408997.095204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408997.219139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408997.341819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408997.470499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408997.599760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408997.729254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408997.856625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408997.999271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408998.128000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408998.262812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408998.415089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408998.527040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408998.652149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638408998.781303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408998.906140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408999.030116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408999.166953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408999.310673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408999.436362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408999.568501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408999.713914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408999.845863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638408999.985190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409000.102057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409000.230553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409000.349657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409000.485717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409000.628444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409000.769199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409000.881541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409001.014863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409001.147468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409001.287353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409001.400741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409001.525802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409001.650176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409001.796334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409001.941036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409002.066352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409002.188690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409002.323193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409002.463379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409002.587492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409002.711093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409002.834081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409002.969603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409003.095282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409003.225470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409003.350938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409003.498142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409003.632127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409003.783606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409003.888997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409004.029047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409004.141816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409004.271781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409004.400909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409004.527528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409004.650052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409004.781201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409004.906879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409005.035179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409005.152940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409005.283244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409005.415601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409005.558297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409005.667769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409005.809198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409005.938627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409006.069097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409006.205482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409006.343853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409006.459583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409006.590388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409006.730973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409006.841345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409006.967223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409007.106777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409007.231584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409007.374836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409007.512695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409007.652885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409007.783097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409007.916054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409008.048036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409008.186076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409008.317985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409008.447245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409008.579900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409008.712441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409008.828671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409008.964072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409009.082474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409009.213146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409009.342467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409009.474100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409009.591216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409009.718969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409009.849572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409009.987055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409010.119757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409010.255433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409010.385819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409010.512488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409010.647502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409010.768429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409010.898468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409011.026269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409011.146278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409011.281013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409011.402943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409011.533974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409011.670908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409011.810249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409011.951882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409012.085674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409012.208265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409012.338792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409012.455923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409012.590622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409012.713518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409012.860382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409012.986590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409013.121971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409013.255855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409013.389042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409013.520674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409013.655600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409013.778340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409013.901906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409014.023952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409014.150872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409014.278254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409014.412992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409014.540441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409014.678321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409014.808102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409014.948559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409015.067338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409015.206577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409015.330301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409015.460452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409015.589263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409015.718465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409015.850442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409015.987484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409016.113790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409016.249965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409016.381877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409016.510394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409016.633629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409016.762200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409016.899207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409017.028460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409017.156764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409017.277339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409017.402930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409017.526864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409017.657284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409017.784415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409017.915616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409018.040545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409018.178898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409018.307437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409018.437698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409018.582036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409018.705719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409018.833736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409018.955171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409019.085898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409019.224972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409019.337134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409019.463867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409019.586110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409019.727686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409019.837533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409019.963498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409020.118936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409020.238238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409020.385556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409020.516532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409020.648594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409020.775386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409020.901351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409021.023452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409021.152768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409021.274487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409021.413073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409021.532057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409021.672373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409021.791882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409021.939222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409022.067579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409022.215898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409022.335568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409022.462886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409022.595510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409022.714283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409022.839703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409022.971468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409023.115755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409023.233789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409023.372334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409023.517805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409023.634484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409023.769301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409023.890720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409024.023374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409024.143167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409024.276212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409024.397989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409024.527130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409024.653944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409024.788636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409024.918843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409025.042566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409025.175816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409025.324704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409025.450454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409025.573910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409025.703920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409025.832791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409025.950606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409026.085477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409026.212574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409026.342985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409026.475245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409026.602896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409026.729022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409026.855190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409027.007696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409027.135489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409027.257810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409027.392574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409027.518191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409027.637000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409027.761164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409027.896188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409028.027372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409028.163179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409028.300719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409028.423323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409028.553965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409028.694938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409028.821512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409028.955190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409029.099446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409029.226366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409029.339958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409029.466840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409029.601713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409029.737181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409029.867887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409030.010182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409030.137630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409030.266721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409030.387305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409030.521946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409030.652485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409030.778877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409030.904813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409031.038491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409031.182312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409031.314118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409031.435866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409031.571940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409031.712847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409031.841906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409031.969921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409032.104391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409032.228222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409032.376522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409032.499662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409032.639341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409032.775710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409032.897705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409033.037737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409033.161799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409033.271839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409033.403852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409033.523228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409033.644608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409033.778090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409033.913278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409034.045653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409034.180414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409034.315117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409034.449725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409034.570539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409034.698823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409034.836937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409034.963678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409035.095293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409035.218892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409035.362976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409035.751251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409035.910502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409036.096756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409036.250669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409036.384317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409036.509327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409036.641552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409036.770009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409036.895323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409037.017487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409037.149074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409037.272238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409037.393888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409037.517516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409037.646856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409037.790029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409037.909186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409038.034634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409038.179884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409038.306008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409038.436633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409038.571126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409038.702652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409038.830301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409038.958816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409039.082693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409039.212586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409039.334329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409039.461959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409039.590840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409039.719446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409039.845329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409039.979266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409040.101587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409040.235330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409040.375476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409040.641229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409040.804088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409040.943356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409041.074869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409041.213134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409041.330007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409041.450025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409041.594162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409041.719966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409041.836578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409041.960766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409042.103255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409042.212712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409042.351043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409042.484329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409042.626410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409042.769690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409042.883848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409043.016639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409043.140621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409043.263963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409043.397325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409043.519751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409043.643402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409043.775201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409044.276782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409044.538300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409044.785666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409045.074602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409045.229130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409045.417691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409045.528750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409045.661849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409045.805695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409045.930840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409046.608356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409046.746290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409046.978817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409047.174064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409047.392785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409047.552359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409047.743460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409047.908089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409048.070129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409048.290571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409048.439887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409048.610250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409048.811153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409048.983431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409049.154683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409049.328990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409049.572872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409049.716406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409049.844926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409049.960422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409050.096215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409050.213366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409050.351320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409050.469109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409050.613722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409050.746869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409050.882233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409051.032923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409051.148590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409051.287017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409051.400582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409051.515702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409051.650949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409051.777587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409051.903525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409052.026569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409052.157001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409052.277128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409052.420401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409052.655595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409052.812143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409052.935989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409053.072747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409053.208579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409053.329055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409053.458282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409053.579518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409053.700928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409053.832998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409053.965489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409054.084179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409054.209918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409054.336865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409054.463587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409054.595797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409054.718019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409054.838859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409054.967325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409055.100231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409055.225472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409055.356758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409055.503463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409055.622346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409055.760571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409055.898664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409056.018919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409056.142443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409056.271858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409056.416869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409056.537331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409056.668236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409056.777979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409056.905903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409057.039686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409057.185073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409057.310041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409057.442284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409057.571435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409057.713842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409057.850643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409057.997482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409058.117093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409058.249679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409058.374703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409058.508349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409058.643202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409058.771410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409058.897022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409059.018018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409059.151791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409059.288056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409059.396100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409059.517914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409059.652010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409059.804762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409059.932211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409060.066947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409060.196608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409060.335008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409060.451810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409060.579460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409060.714445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409060.830059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409060.960281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409061.082822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409061.212971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409061.336012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409061.459779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409061.598831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409061.744542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409061.884242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409062.006683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409062.128867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409062.254067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409062.393447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409062.518080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409062.653337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409062.761040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409062.893032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409063.017343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409063.146779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409063.290109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409063.412573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409063.530130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409063.656786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409063.783072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409063.920787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409064.062297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409064.179441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409064.312341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409064.451616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409064.580989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409064.705291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409064.844031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409064.955793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409065.086302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409065.202367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409065.335016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409065.459873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409065.585177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409065.705086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409065.851046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409065.961497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409066.091483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409066.225940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409066.363827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409066.478651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409066.627122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409066.763629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409066.895652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409067.019702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409067.146816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409067.273881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409067.394319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409067.538532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409067.666007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409067.778676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409067.912479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409068.037744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409068.169238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409068.296353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409068.433918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409068.567766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409068.696796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409068.830464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409068.948833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409069.076990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409069.210556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409069.333745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409069.464812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409069.594556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409069.711877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409069.850718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409069.983195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409070.100957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409070.246640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409070.373872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409070.491870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409070.628225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409070.775277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409070.904740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409071.059051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409071.186368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409071.314027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409071.450248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409071.573196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409071.706020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409071.842167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409071.959788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409072.086439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409072.211440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409072.352069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409072.473812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409072.608170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409072.733274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409072.875682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409072.993134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409073.122025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409073.259323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409073.398947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409073.526803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409073.668663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409073.812680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409073.938618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409074.066061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409074.206090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409074.324479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409074.456949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409074.582489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409074.705864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409074.833797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409074.960022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409075.083389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409075.208021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409075.331007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409075.458725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409075.582097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409075.731844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409075.855326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409075.979890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409076.126649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409076.258757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409076.402029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409076.539527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409076.646628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409076.766288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409076.902358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409077.032512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409077.154189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409077.285559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409077.412051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409077.560816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409077.678475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409077.833642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409077.953868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409078.087873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409078.211883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409078.347617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409078.475983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409078.597088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409078.730399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409078.874878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409079.007667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409079.141733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409079.264416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409079.394107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409079.522917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409079.646944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409079.767776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409079.899920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409080.020542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409080.156981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409080.279176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409080.431771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409080.554362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409080.692626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409080.820986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409080.951122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409081.073197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409081.202605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409081.329116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409081.458307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409081.581043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409081.721727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409081.834011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409081.972510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409082.099751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409082.233145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409082.371401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409082.515218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409082.639317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409082.764926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409082.886612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409083.018924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409083.147248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409083.268629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409083.402293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409083.532260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409083.656233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409083.787113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409083.919392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409084.060034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409084.196142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409084.324107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409084.451383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409084.581802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409084.705299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409084.835913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409084.958613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409085.086984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409085.210461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409085.352025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409085.478396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409085.606606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409085.746440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409085.869670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409085.996486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409086.206062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409086.534814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409086.836793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409087.084737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409087.224167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409087.365281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409087.496358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409087.634364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409087.751249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409087.877748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409088.004882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409088.153183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409088.260311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409088.386374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409088.513976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409088.636677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409088.760345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409088.890744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409089.008294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409089.138459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409089.267798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409089.408967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409089.517656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409089.648985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409089.784312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409089.891385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409090.021184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409090.153170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409090.272222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409090.395350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409090.518045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409090.649783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409090.771836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409090.894382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409091.022785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409091.148493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409091.270452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409091.394068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409091.524475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409091.668198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409091.778848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409091.944858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409092.061180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409092.229081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409092.353821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409092.483199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409092.625745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409092.749846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409092.878772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409093.005857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409093.131609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409093.263254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409093.386406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409093.522153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409093.647023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409093.770658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409093.900251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409094.047096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409094.160791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409094.305692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409094.444165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409094.586813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409094.703674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409094.834583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409094.953095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409095.082379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409095.206836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409095.335798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409095.455116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409095.581019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409095.708703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409095.837783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409095.957933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409096.087139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409096.209708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409096.336039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409096.474534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409096.586869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409096.710706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409096.830691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409096.957610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409097.080081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409097.210076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409097.341308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409097.453872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409097.584055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409097.705280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409097.831620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409097.972815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409098.088633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409098.206982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409098.335337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409098.457287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409098.586950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409098.705734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409098.834892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409098.960639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409099.085783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409099.215840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409099.346658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409099.483423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409099.623119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409099.756198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409099.892399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409100.015699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409100.144277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409100.267134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409100.398064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409100.517916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409100.647059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409100.772456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409100.888768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409101.020734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409101.150842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409101.268973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409101.388672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409101.528384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409101.642821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409101.762601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409101.888078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409102.014801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409102.148062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409102.270752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409102.391265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409102.524611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409102.641539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409102.762832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409102.893369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409103.019726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409103.146734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409103.275239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409103.402844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409103.534271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409103.668197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409103.823452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409103.938272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409104.076520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409104.204081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409104.331092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409104.455999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409104.584765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409104.707304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409104.830380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409104.965628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409105.076482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409105.203696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409105.340105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409105.462896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409105.595803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409105.721076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409105.847483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409105.982873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409106.110725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409106.256809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409106.386259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409106.519459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409106.657126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409106.771044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409106.894587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409107.023262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409107.144931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409107.271545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409107.394558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409107.521472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409107.644526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409107.770582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409107.906606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409108.017204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409108.142406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409108.276367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409108.403299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409108.528033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409108.653628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409108.790243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409108.915188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409109.044843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409109.160280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409109.294694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409109.437711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409109.576488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409109.699737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409109.824939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409109.950470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409110.070976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409110.198777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409110.329590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409110.466838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409110.589226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409110.706022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409110.827042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409110.963115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409111.081885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409111.208768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409111.340600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409111.460254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409111.583361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409111.730514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409111.848573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409111.975288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409112.110215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409112.248310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409112.386055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409112.508040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409112.634719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409112.755518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409112.877104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409113.013043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409113.143749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409113.258923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409113.391933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409113.517017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409113.647493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409113.780125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409113.915155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409114.030277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409114.176021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409114.296759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409114.440105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409114.575034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409114.688835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409114.821630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409114.942573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409115.064723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409115.196733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409115.331895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409115.461818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409115.593320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409115.730739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409115.854097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409115.972652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409116.099127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409116.225522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409116.362095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409116.500299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409116.638905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409116.767530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409116.883268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409117.017467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409117.134604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409117.267451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409117.386851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409117.521446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409117.642335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409117.775322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409117.903330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409118.030021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409118.172155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409118.287671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409118.418063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409118.550411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409118.687656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409118.812363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409118.954885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409119.098433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409119.209118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409119.327641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409119.460892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409119.582589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409119.710419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409119.849115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409119.974545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409120.112010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409120.250252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409120.384570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409120.515705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409120.641015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409120.766440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409120.897482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409121.019141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409121.147208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409121.288455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409121.397223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409121.524637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409121.648459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409121.789171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409121.927694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409122.051369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409122.181189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409122.308410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409122.451186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409122.569034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409122.707015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409122.824409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409122.946859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409123.081867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409123.206334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409123.336216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409123.460537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409123.595789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409123.709249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409123.833211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409123.960773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409124.085077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409124.210870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409124.338936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409124.456823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409124.583876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409124.707174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409124.832777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409124.963478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409125.092565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409125.224791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409125.349775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409125.475473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409125.597559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409125.732981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409125.859288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409125.990487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409126.129209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409126.260435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409126.384194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409126.523916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409126.644001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409126.773147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409126.900947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409127.027742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409127.159220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409127.288803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409127.408056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409127.544604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409127.679443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409127.816949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409127.953374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409128.072897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409128.215623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409128.323864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409128.452745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409128.582363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409128.706477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409128.848800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409128.967053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409129.076629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409129.206193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409129.333208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409129.461034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409129.587167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409129.715873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409129.838634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409129.978407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409130.090798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409130.219178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409130.357314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409130.467528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409130.598920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409130.729581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409130.860689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409130.998797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409131.123757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409131.258055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409131.389675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409131.515694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409131.648450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409131.775637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409131.924478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409132.038592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409132.169301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409132.294355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409132.414625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409132.556785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409132.691364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409132.825195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409132.947457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409133.078040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409133.205694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409133.335506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409133.470986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409133.582528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409133.706856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409133.839638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409133.983449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409134.101279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409134.224466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409134.364873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409134.499936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409134.622187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409134.744963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409134.879149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409135.012869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409135.132492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409135.260252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409135.387650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409135.522923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409135.646811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409135.783124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409135.926361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409136.057196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409136.189866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409136.320266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409136.440968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409136.576984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409136.695296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409136.819564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409136.946131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409137.083711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409137.208500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409137.331397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409137.459131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409137.585341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409137.712496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409137.840949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409137.963114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409138.095783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409138.225878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409138.348033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409138.484279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409138.621043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409138.735854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409138.891096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409138.999196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409139.117146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409139.262216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409139.409271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409139.515260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409139.646017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409139.770717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409139.892687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409140.037484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409140.157932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409140.293413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409140.418239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409140.545310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409140.684137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409140.806121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409140.946912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409141.082770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409141.209291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409141.331765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409141.448593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409141.589623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409141.708766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409141.839180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409141.962603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409142.087968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409142.221633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409142.351577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409142.476332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409142.611497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409142.744704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409142.876169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409143.011256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409143.135097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409143.263366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409143.378540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409143.513260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409143.642452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409143.767782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409143.886433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409144.013163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409144.133639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409144.270182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409144.390837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409144.520694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409144.645455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409144.771578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409144.897571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409145.021288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409145.159778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409145.270083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409145.395950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409145.521136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409145.642658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409145.777651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409145.918897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409146.029519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409146.150962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409146.277261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409146.397851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409146.527815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409146.659005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409146.782896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409146.912034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409147.078377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409147.160115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409147.299354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409147.431369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409147.568468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409147.698285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409147.832857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409147.954362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409148.085193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409148.211251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409148.339134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409148.468277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409148.598613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409148.723364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409148.861533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409148.988524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409149.118124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409149.244650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409149.381770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409149.500653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409149.628562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409149.760415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409149.889232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409150.026252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409150.139254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409150.257096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409150.380585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409150.505757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409150.629348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409150.756743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409150.883667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409151.012595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409151.145092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409151.262440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409151.396728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409151.512638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409151.643502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409151.771938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409151.903285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409152.040324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409152.158759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409152.286047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409152.411655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409152.539977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409152.679595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409152.807845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409152.932908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409153.067842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409153.194629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409153.327880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409153.472683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409153.578951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409153.699030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409153.828954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409153.958532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409154.076829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409154.206818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409154.324575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409154.449605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409154.580255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409154.713878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409154.833863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409154.961855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409155.095281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409155.228952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409155.345231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409155.473501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409155.600310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409155.744849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409155.872117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409156.000029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409156.137040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409156.268814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409156.393413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409156.514403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409156.636152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409156.768769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409156.884429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409157.015657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409157.151777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409157.276130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409157.403974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409157.526380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409157.646312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409157.778923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409157.916067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409158.060631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409158.182328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409158.312041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409158.466601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409158.573830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409158.692415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409158.826115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409158.962008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409159.085086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409159.205969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409159.327146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409159.453303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409159.579717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409159.703465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409159.835897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409159.959536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409160.085252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409160.210646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409160.341241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409160.464309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409160.614018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409160.724744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409160.849734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409160.988791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409161.126575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409161.249738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409161.389107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409161.505949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409161.652872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409161.754491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409161.889128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409162.022928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409162.168249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409162.290413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409162.405247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409162.538990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409162.666941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409162.801162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409162.932416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409163.060662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409163.188937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409163.316193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409163.441973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409163.574478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409163.713354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409163.827034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409163.959122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409164.078288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409164.216415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409164.497824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409164.824574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409165.007424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409165.153536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409165.335687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409165.516206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409165.668697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409165.853059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409166.030401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409166.219007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409166.339988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409166.579715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409166.714293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409166.828507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409167.027141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409167.157726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409167.327216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409167.508482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409167.683013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409167.908819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409168.025709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409168.158828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409168.281651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409168.414186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409168.552037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409168.682803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409168.812065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409168.942330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409169.068901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409169.202083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409169.314891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409169.443007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409169.565240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409169.699881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409169.825027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409169.953905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409170.072154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409170.219534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409170.322442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409170.459968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409170.575611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409170.704365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409170.838050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409171.060682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409171.188174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409171.315197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409171.451854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409171.570234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409171.688310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409171.821248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409171.948041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409172.078157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409172.201791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409172.329025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409172.456242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409172.584794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409172.710984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409172.839881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409172.970036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409173.106085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409173.232749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409173.363051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409173.501451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409173.626143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409173.740338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409173.877120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409174.004926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409174.132809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409174.254707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409174.384423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409174.511014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409174.645346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409174.768783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409174.899213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409175.018240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409175.146323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409175.269870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409175.398175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409175.521963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409175.649942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409175.772122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409175.896602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409176.022388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409176.169575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409176.305979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409176.452313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409176.564671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409176.700104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409176.825662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409176.956868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409177.079639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409177.210857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409177.335784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409177.461564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409177.584343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409177.709632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409177.844219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409177.982910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409178.100057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409178.244062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409178.370091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409178.508465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409178.635256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409178.764847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409178.887234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409179.017158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409179.141491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409179.268714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409179.390242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409179.521732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409179.652387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409179.798486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409179.926226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409180.057572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409180.188792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409180.319420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409180.439794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409180.572829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409180.702797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409180.837114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409180.958024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409181.095702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409181.212883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409181.348454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409181.466106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409181.597644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409181.761689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409181.900506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409182.014012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409182.145605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409182.269886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409182.395217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409182.521016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409182.643929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409182.765003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409182.901894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409183.017692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409183.146528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409183.286170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409183.402664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409183.524479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409183.667326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409183.804764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409183.947053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409184.071147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409184.200354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409184.317552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409184.454084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409184.570255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409184.703423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409184.826698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409184.972294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409185.078910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409185.208925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409185.335706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409185.452262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409185.579245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409185.723785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409185.840604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409185.964079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409186.091491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409186.208688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409186.327335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409186.457258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409186.578859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409186.704554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409186.833812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409186.969500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409187.103741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409187.242502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409187.368763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409187.493080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409187.620184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409187.755541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409187.886796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409188.011396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409188.138721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409188.262800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409188.389140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409188.514884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409188.637923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409188.767910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409188.884959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409189.029772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409189.139504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409189.283812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409189.395961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409189.525076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409189.648397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409189.777212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409189.914659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409190.034350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409190.163085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409190.285258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409190.444260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409190.557492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409190.687096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409190.821346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409190.944440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409191.083952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409191.215138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409191.330712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409191.455353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409191.580516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409191.699204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409191.830813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409191.956054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409192.081548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409192.205067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409192.330473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409192.456541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409192.571630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409192.698695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409192.834201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409192.950907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409193.081440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409193.202770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409193.330975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409193.462646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409193.582880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409193.697541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409193.830799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409193.960386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409194.077648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409194.211710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409194.330561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409194.453696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409194.578967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409194.701274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409194.832119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409194.973018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409195.075797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409195.203400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409195.331988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409195.469326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409195.575377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409195.707924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409195.841367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409195.960757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409196.085432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409196.213897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409196.343041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409196.465286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409196.598054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409196.724999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409196.869978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409196.992088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409197.115626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409197.255777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409197.382007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409197.512704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409197.635763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409197.763620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409197.887993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409198.004438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409198.140084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409198.263107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409198.385618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409198.531567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409198.654801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409198.781506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409198.887086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409199.031661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409199.143897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409199.269426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409199.392287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409199.508855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409199.640785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409199.763382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409199.892832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409200.033018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409200.160415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409200.284047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409200.414117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409200.550929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409200.681222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409200.811640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409200.946378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409201.078125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409201.203903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409201.320769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409201.443504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409201.565573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409201.712409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409201.835499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409201.970087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409202.103374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409202.238719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409202.375875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409202.499352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409202.626823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409202.750525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409202.877529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409203.003694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409203.135737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409203.262380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409203.375690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409203.513713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409203.639420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409203.764375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409203.897050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409204.022083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409204.143885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409204.269264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409204.395375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409204.536901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409204.656321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409204.789737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409204.932854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409205.050857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409205.187492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409205.308518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409205.438475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409205.571632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409205.708377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409205.829671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409205.951945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409206.078873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409206.197973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409206.345327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409206.455139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409206.582371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409206.707953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409206.836648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409206.952531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409207.079698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409207.226036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409207.331334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409207.452060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409207.579329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409207.702369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409207.831505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409207.972618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409208.093935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409208.229609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409208.370793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409208.495955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409208.635013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409208.759579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409208.890653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409209.011557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409209.153720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409209.268034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409209.383125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409209.527560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409209.639610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409209.770332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409209.889658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409210.017331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409210.143788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409210.269305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409210.391987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409210.516241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409210.646830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409210.775005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409210.905623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409211.028111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409211.158394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409211.282907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409211.408933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409211.536209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409211.673743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409211.836543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409211.956899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409212.081285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409212.211950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409212.332519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409212.453637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409212.597589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409212.719713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409212.834878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409212.976207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409213.093905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409213.219927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409213.337638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409213.468358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409213.594287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409213.720327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409213.853548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409213.974385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409214.104060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409214.238073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409214.375112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409214.511811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409214.631005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409214.762182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409214.888048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409215.018768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409215.147379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409215.290740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409215.388730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409215.519442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409215.640728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409215.769949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409215.888909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409216.014370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409216.136930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409216.266361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409216.389624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409216.515022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409216.636557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409216.758943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409216.888783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409217.022425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409217.128567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409217.274313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409217.400618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409217.517508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409217.644685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409217.777431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409217.899113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409218.027040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409218.177652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409218.283588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409218.430697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409218.563125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409218.690263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409218.825989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409218.970398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409219.085069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409219.219331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409219.325141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409219.454731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409219.580437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409219.704123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409219.829495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409219.968189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409220.078710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409220.203224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409220.336321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409220.464544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409220.586085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409220.723007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409220.847725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409220.986630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409221.134703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409221.251948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409221.384226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409221.501323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409221.626939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409221.755430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409221.885769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409222.011096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409222.131683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409222.277755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409222.390914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409222.514426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409222.640844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409222.778100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409222.911183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409223.018421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409223.148819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409223.270565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409223.394811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409223.512020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409223.639875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409223.756360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409223.885848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409224.014105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409224.130444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409224.266087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409224.383771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409224.513838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409224.639641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409224.773903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409224.891250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409225.017212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409225.161556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409225.268406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409225.403290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409225.526700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409225.653455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409225.771837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409225.901554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409226.038401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409226.177109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409226.311833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409226.454458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409226.559523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409226.687925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409226.820780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409226.952916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409227.068553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409227.225650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409227.334273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409227.462434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409227.587927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409227.720318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409227.847800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409227.978469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409228.103673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409228.242503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409228.368118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409228.493566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409228.626464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409228.756257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409228.878171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409229.017737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409229.136790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409229.280036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409229.383555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409229.519656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409229.652760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409229.770344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409229.902820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409230.035880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409230.141826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409230.265436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409230.394915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409230.528094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409230.644121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409230.775388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409230.900057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409231.036078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409231.154725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409231.295168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409231.426676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409231.556574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409231.688492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409231.829429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409231.949890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409232.078768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409232.204257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409232.327264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409232.456235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409232.581779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409232.698868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409232.826518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409232.956401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409233.096545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409233.205036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409233.334649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409233.457868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409233.598868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409233.723172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409233.852396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409233.964786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409234.104640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409234.235184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409234.367412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409234.493009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409234.648615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409234.754621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409234.900819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409235.000655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409235.140631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409235.249991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409235.386816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409235.511364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409235.634599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409235.764683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409235.884170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409236.005877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409236.137654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409236.254725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409236.388047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409236.501323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409236.637273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409236.754143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409236.885501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409237.013029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409237.136905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409237.256271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409237.384456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409237.501321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409237.634396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409237.755797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409237.885227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409238.012494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409238.137967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409238.271398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409238.393894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409238.515797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409238.662142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409238.770900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409238.892478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409239.019238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409239.150527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409239.274790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409239.398022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409239.520062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409239.658539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409239.802047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409239.945959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409240.055631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409240.199896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409240.327032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409240.453577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409240.572346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409240.703482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409240.843139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409240.971761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409241.086345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409241.217203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409241.342600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409241.485763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409241.621961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409241.768859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409241.890677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409242.039399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409242.147386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409242.273451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409242.395487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409242.525712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409242.647118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409242.789767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409242.909713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409243.034438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409243.164173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409243.301825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409243.428704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409243.578856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409243.717345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409243.829970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409243.970658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409244.098466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409244.240980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409244.370353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409244.497562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409244.628441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409244.757348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409244.887277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409245.014198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409245.142330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409245.257161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409245.388877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409245.505797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409245.641162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409245.760234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409245.893800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409246.008013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409246.143648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409246.279575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409246.390569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409246.513942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409246.654001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409246.775953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409246.912323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409247.030391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409247.161188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409247.299664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409247.422559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409247.556540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409247.693690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409247.816586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409247.951025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409248.076071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409248.209865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409248.329463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409248.471194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409248.576614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409248.706496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409248.849689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409248.957695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409249.096236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409249.201733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409249.321188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409249.447968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409249.573457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409249.702411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409249.826933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409249.942096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409250.069530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409250.201750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409250.331858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409250.451635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409250.575002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409250.721028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409250.832331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409250.957809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409251.085320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409251.212529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409251.337684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409251.465703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409251.595954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409251.734138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409251.866460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409252.003156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409252.126771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409252.265182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409252.388396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409252.512335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409252.636769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409252.771731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409252.888657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409253.015648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409253.136613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409253.265325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409253.391643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409253.516987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409253.639751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409253.767701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409253.895249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409254.019421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409254.144356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409254.273214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409254.409188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409254.523114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409254.646827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409254.770895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409254.897432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409255.033337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409255.158029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409255.280211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409255.421759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409255.541075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409255.679049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409255.815618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409255.944416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409256.072937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409256.198210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409256.345259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409256.454153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409256.587305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409256.712973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409256.840242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409256.972920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409257.094947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409257.220570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409257.350432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409257.476824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409257.618865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409257.737473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409257.876883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409258.002251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409258.134700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409258.258558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409258.385879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409258.523395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409258.644905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409258.766387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409258.894551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409259.020156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409259.149289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409259.270592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409259.408990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409259.523614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409259.654241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409259.779484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409259.912955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409260.056623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409260.187281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409260.313093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409260.452026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409260.567593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409260.700590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409260.820730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409260.951067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409261.074579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409261.198316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409261.329053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409261.454948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409261.580992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409261.707921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409261.842310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409261.972413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409262.092595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409262.220639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409262.346994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409262.477462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409262.615331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409262.758415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409262.871061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409263.000845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409263.129721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409263.256355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409263.383559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409263.510631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409263.629766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409263.761472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409263.880880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409264.009468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409264.126543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409264.262277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409264.384873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409264.510614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409264.648741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409264.762405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409264.886932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409265.012363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409265.141469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409265.280649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409265.386615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409265.536089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409265.642435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409265.767668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409265.888488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409266.016688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409266.142227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409266.281232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409266.398739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409266.532364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409266.664269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409266.792021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409266.920781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409267.039965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409267.183096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409267.303505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409267.431924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409267.561288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409267.691032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409267.819953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409267.945013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409268.069761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409268.196284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409268.323853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409268.444465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409268.577743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409268.690869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409268.815522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409268.944357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409269.075693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409269.197697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409269.323869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409269.444905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409269.576478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409269.702497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409269.831959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409269.953166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409270.079835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409270.201222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409270.354336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409270.458171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409270.584918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409270.719352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409270.853458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409270.983240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409271.124070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409271.250523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409271.387801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409271.509828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409271.642407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409271.773464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409271.910462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409272.035560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409272.192360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409272.312374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409272.448331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409272.568618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409272.706777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409272.824058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409272.963111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409273.059797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409273.201211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409273.316030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409273.447991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409273.577599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409273.699366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409273.824499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409273.957347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409274.081785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409274.207476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409274.325358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409274.452658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409274.592649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409274.705952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409274.827406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409274.954968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409275.083489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409275.215942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409275.337756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409275.468603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409275.594454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409275.753400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409275.869928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409275.997054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409276.125212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409276.253420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409276.375979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409276.498638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409276.620959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409276.753052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409276.878483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409277.015823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409277.133632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409277.262278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409277.389287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409277.512973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409277.635140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409277.762911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409277.888948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409278.015584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409278.145296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409278.274738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409278.406219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409278.530499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409278.657964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409278.802814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409278.928652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409279.056074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409279.193135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409279.321415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409279.462538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409279.577044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409279.695608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409279.830716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409279.951319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409280.082978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409280.209635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409280.346929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409280.469131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409280.609796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409280.731560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409280.866868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409281.000709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409281.142225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409281.262891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409281.384832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409281.512968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409281.639669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409281.767077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409281.891597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409282.006693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409282.130513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409282.259529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409282.378870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409282.501819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409282.634189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409282.758324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409282.888855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409283.010980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409283.141809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409283.265840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409283.408232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409283.519231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409283.646971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409283.767333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409283.897985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409284.040802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409284.161741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409284.290314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409284.419908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409284.554612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409284.686871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409284.815778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409284.926584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409285.059761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409285.203944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409285.492336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409285.723723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409285.952049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409286.122739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409286.300946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409286.487252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409286.643625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409286.813776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409286.981611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409287.139347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409287.314334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409287.468756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409287.693521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409287.846889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409288.002051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409288.186702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409288.387574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409288.550014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409288.711086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409288.877256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409289.051278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409289.223399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409289.365768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409289.493839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409289.619562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409289.745879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409289.870093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409290.016293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409290.140768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409290.266733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409290.387272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409290.513758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409290.639513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409290.760117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409290.885157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409291.016467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409291.141078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409291.259270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409291.392799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409291.508396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409291.644771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409291.751757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409291.890295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409292.011851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409292.145329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409292.388138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409292.509862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409292.635879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409292.772062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409292.892486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409293.015890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409293.148420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409293.275828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409293.406330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409293.544214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409293.669023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409293.815283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409293.936004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409294.071706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409294.197007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409294.310168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409294.454504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409294.559084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409294.692698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409294.818694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409294.938508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409295.063690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409295.195508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409295.322663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409295.450176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409295.573330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409295.701963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409295.821472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409295.945945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409296.065200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409296.203403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409296.332987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409296.472744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409296.577128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409296.706152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409296.832254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409296.957533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409297.099984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409297.233702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409297.352229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409297.528873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409297.637748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409297.766196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409297.892407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409298.016965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409298.147028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409298.274288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409298.405734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409298.531106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409298.657233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409298.788924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409298.913373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409299.050164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409299.190996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409299.322737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409299.440393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409299.590242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409299.705446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409299.822695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409299.969652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409300.078281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409300.222845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409300.336409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409300.456012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409300.585206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409300.715631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409300.851628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409301.000775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409301.125564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409301.253965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409301.389906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409301.515119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409301.650262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409301.814020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409301.945667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409302.061284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409302.190193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409302.323958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409302.457912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409302.581705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409302.718676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409302.844004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409302.969151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409303.094096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409303.220577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409303.354759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409303.488705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409303.618388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409303.764096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409303.894840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409304.017164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409304.141018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409304.269305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409304.393314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409304.523189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409304.648257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409304.772880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409304.905607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409305.030064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409305.157680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409305.296840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409305.426133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409305.557420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409305.688623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409305.822074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409305.946267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409306.076277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409306.196091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409306.321021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409306.460354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409306.570316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409306.694748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409306.818647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409306.943639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409307.074032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409307.215170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409307.327189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409307.451444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409307.575365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409307.701723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409307.828966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409307.967203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409308.085086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409308.217304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409308.355159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409308.482123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409308.622041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409308.747078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409308.876461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409309.003797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409309.124999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409309.256137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409309.379064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409309.506971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409309.624939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409309.750817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409309.876815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409310.005426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409310.133302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409310.252259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409310.383700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409310.520235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409310.640299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409310.764638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409310.888171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409311.007778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409311.135552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409311.262511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409311.406931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409311.532146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409311.643041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409311.774331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409311.895974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409312.022998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409312.148382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409312.277892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409312.406473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409312.529317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409312.693543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409312.805173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409312.940358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409313.068276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409313.190946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409313.313317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409313.444284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409313.566263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409313.696168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409313.839981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409313.960660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409314.079234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409314.204844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409314.332857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409314.460455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409314.596804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409314.720098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409314.851503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409314.968293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409315.117172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409315.240601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409315.383490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409315.504350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409315.626078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409315.762098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409315.894041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409316.018629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409316.147720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409316.280487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409316.398238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409316.522448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409316.656795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409316.788513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409316.928528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409317.062387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409317.189282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409317.316936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409317.440371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409317.564644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409317.699259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409317.827270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409317.945157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409318.070852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409318.194668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409318.308743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409318.448224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409318.595379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409318.725734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409318.833641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409318.970211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409319.095084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409319.218882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409319.364032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409319.478014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409319.612583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409319.743419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409319.871973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409320.001827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409320.131194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409320.252040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409320.385814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409320.513253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409320.663311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409320.767723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409320.897166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409321.031424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409321.156563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409321.287638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409321.427376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409321.548038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409321.692338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409321.818007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409321.949819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409322.069682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409322.192712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409322.323467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409322.450474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409322.574641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409322.704264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409322.824832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409322.950247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409323.075422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409323.218758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409323.326719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409323.448460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409323.580550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409323.703145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409323.827354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409323.955238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409324.076242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409324.202761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409324.321719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409324.449653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409324.572560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409324.700359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409324.830485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409324.953839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409325.084490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409325.206121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409325.340986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409325.460932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409325.592286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409325.740080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409325.879983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409326.001825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409326.126281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409326.249186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409326.384187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409326.507668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409326.636095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409326.758145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409326.885370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409327.022061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409327.135784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409327.261018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409327.388274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409327.520000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409327.645185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409327.776396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409327.906853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409328.038957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409328.181021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409328.306178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409328.428887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409328.579957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409328.682984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409328.822151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409328.955060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409329.070191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409329.199537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409329.329887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409329.464823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409329.577031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409329.721462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409329.845605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409329.948932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409330.085605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409330.202418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409330.324174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409330.454889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409330.577002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409330.700865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409330.818983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409330.945438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409331.073519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409331.194253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409331.321315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409331.448923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409331.573031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409331.705577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409331.831347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409331.988680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409332.093781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409332.234796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409332.365081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409332.499351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409332.631319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409332.759784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409332.883993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409333.012809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409333.142259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409333.265369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409333.397023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409333.520728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409333.648785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409333.784614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409333.918375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409334.057467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409334.181598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409334.310955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409334.441924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409334.566254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409334.705886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409334.818973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409334.952068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409335.069311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409335.199922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409335.323596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409335.444083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409335.577892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409335.703324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409335.823234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409335.971253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409336.075244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409336.212124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409336.318847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409336.453688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409336.569314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409336.700960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409336.817190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409336.963665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409337.074747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409337.221249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409337.327291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409337.454077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409337.581998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409337.714066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409337.834273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409337.969959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409338.096356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409338.239723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409338.370437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409338.502858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409338.622038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409338.760294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409338.878919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409339.020917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409339.147278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409339.264457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409339.390073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409339.521982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409339.643494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409339.788284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409339.929004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409340.026751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409340.162812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409340.302807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409340.426800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409340.548373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409340.694344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409340.821976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409340.943877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409341.068763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409341.216731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409341.329501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409341.452095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409341.576696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409341.695155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409341.821755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409341.963980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409342.076288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409342.200221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409342.326116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409342.452734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409342.577843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409342.699323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409342.828785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409342.957664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409343.084514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409343.207067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409343.339364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409343.468917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409343.591584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409343.716629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409343.859044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409343.970615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409344.096368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409344.226621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409344.366964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409344.503379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409344.631838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409344.750201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409344.884091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409345.009552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409345.140530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409345.263158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409345.384727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409345.515414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409345.657111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409345.758778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409345.888527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409346.013064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409346.139162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409346.261253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409346.377347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409346.506581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409346.627393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409346.761764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409346.876915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409347.013007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409347.140422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409347.274848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409347.385906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409347.513612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409347.657831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409347.770437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409347.904418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409348.039287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409348.182307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409348.312132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409348.433530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409348.565723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409348.694483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409348.832786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409348.948008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409349.072619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409349.204017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409349.323273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409349.451698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409349.573777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409349.705808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409349.827662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409349.950646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409350.080043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409350.209893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409350.336391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409350.467696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409350.596324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409350.719417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409350.854743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409350.992123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409351.118761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409351.242330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409351.383979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409351.500275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409351.621503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409351.758563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409351.880818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409352.001087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409352.134808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409352.264486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409352.386429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409352.512994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409352.631314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409352.760766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409352.882912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409353.013602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409353.136832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409353.283232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409353.387631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409353.509239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409353.643770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409353.764151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409353.891598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409354.021828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409354.155484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409354.280030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409354.407007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409354.563408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409354.678196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409354.816670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409354.935273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409355.080688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409355.197532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409355.325706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409355.445368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409355.567234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409355.698579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409355.826327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409355.948999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409356.075578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409356.201624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409356.328146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409356.449695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409356.580207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409356.710692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409356.839936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409356.954600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409357.077422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409357.200988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409357.328125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409357.460240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409357.571583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409357.701469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409357.834824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409357.958881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409358.094105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409358.220203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409358.354008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409358.484884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409358.605737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409358.745074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409358.878075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409359.011192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409359.130224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409359.260311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409359.388604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409359.507832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409359.631438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409359.769424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409359.903836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409360.031257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409360.164967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409360.298928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409360.434879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409360.573034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409360.693282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409360.813611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409360.941852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409361.070766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409361.199557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409361.322083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409361.450832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409361.581743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409361.711802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409361.840172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409361.994078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409362.102461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409362.250167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409362.391631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409362.510612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409362.634969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409362.765294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409362.883914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409363.015547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409363.144989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409363.263180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409363.381651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409363.504552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409363.636792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409363.764066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409363.892729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409364.026569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409364.161935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409364.287796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409364.420280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409364.549838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409364.686538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409364.840041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409364.947914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409365.080932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409365.199804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409365.325897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409365.441220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409365.570697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409365.691551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409365.821221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409365.943023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409366.075563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409366.206208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409366.334894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409366.467833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409366.597496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409366.726233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409366.866676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409366.999107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409367.128850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409367.251137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409367.374878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409367.498891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409367.626710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409367.750424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409367.880349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409367.997189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409368.136058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409368.253648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409368.379473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409368.510560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409368.634454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409368.777236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409368.885767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409369.027548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409369.140214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409369.265916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409369.393456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409369.517461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409369.649310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409369.792499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409369.904653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409370.046544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409370.176842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409370.310678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409370.461288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409370.576777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409370.707911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409370.835000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409370.973650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409371.092451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409371.223888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409371.363437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409371.499318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409371.628922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409371.761827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409371.884184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409372.008882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409372.138757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409372.279896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409372.410198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409372.547933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409372.671464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409372.813840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409372.940713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409373.069660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409373.196847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409373.319949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409373.443750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409373.580296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409373.696681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409373.825195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409373.949139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409374.083202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409374.201949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409374.339915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409374.455091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409374.593994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409374.704919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409374.835009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409374.958154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409375.082120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409375.217596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409375.340692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409375.468873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409375.599362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409375.758960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409375.875327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409376.010573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409376.140518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409376.257941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409376.376564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409376.496616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409376.629972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409376.749827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409376.877518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409376.994332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409377.136279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409377.278981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409377.388835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409377.511089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409377.638375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409377.765616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409377.893194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409378.018723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409378.146612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409378.273850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409378.402644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409378.529808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409378.668572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409378.798156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409378.943275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409379.062932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409379.186099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409379.313752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409379.442211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409379.567485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409379.697699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409379.820927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409379.938679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409380.077158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409380.203153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409380.324633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409380.459362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409380.581911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409380.702959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409380.835074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409380.964349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409381.091434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409381.218297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409381.362983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409381.485707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409381.616467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409381.745373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409381.870320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409382.002810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409382.124122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409382.256244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409382.376437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409382.511776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409382.630277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409382.771021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409382.883683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409383.012466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409383.137889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409383.274972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409383.383530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409383.515726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409383.638798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409383.766027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409383.910743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409384.021872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409384.149749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409384.286145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409384.400227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409384.535925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409384.655699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409384.798093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409384.926005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409385.054621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409385.182345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409385.317408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409385.440053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409385.562614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409385.678974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409385.812731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409385.934571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409386.067279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409386.312488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409386.545887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409386.825637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409387.149800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409387.381238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409387.677140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409387.830649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409387.973336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409388.108393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409388.260347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409388.376601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409388.505872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409388.629989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409388.759399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409388.884771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409389.014833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409389.131694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409389.271136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409389.414904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409389.544262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409389.677473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409389.814325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409389.938141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409390.065854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409390.181555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409390.378586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409390.506739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409390.634567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409390.750503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409390.882127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409391.003513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409391.132037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409391.265161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409391.450862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409391.573875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409391.721292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409391.845014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409391.960229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409392.084917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409392.268999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409392.417990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409392.563797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409392.684546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409392.815537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409392.937922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409393.070148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409393.194112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409393.322744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409393.442917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409393.571802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409393.697163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409393.838160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409393.963103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409394.108397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409394.220488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409394.359635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409394.482907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409394.620859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409394.742399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409394.877347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409394.996231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409395.129248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409395.256954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409395.399117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409395.511804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409395.645020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409395.776703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409395.904683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409396.020850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409396.162445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409396.289113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409396.430643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409396.553351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409396.687843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409396.813781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409396.942265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409397.064306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409397.195767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409397.322392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409397.455224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409397.567786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409397.694560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409397.822770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409397.964801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409398.074758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409398.205894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409398.334096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409398.465774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409398.593990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409398.720152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409398.854334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409398.982836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409399.129017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409399.246099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409399.368294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409399.492415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409399.636677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409399.754493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409399.883203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409400.012529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409400.130427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409400.260645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409400.385094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409400.513543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409400.633207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409400.761490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409400.887800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409401.009474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409401.130525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409401.259308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409401.382503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409401.509267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409401.626782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409401.751283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409401.878107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409402.010609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409402.134801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409402.261014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409402.385249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409402.512840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409402.636178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409402.768404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409402.886144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409403.010084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409403.138853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409403.276193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409403.388732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409403.518739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409403.643524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409403.762982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409403.890742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409404.015098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409404.143095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409404.261508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409404.395009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409404.529059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409404.644555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409404.793129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409404.913017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409405.033918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409405.176912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409405.301908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409405.446861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409405.568035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409405.686776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409405.829819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409406.102684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409406.485770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409406.713658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409406.905166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409407.085227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409407.242108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409407.400272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409407.609304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409407.761677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409407.920243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409408.114765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409408.302148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409408.467248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409408.657285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409408.795246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409408.969764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409409.172135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409409.316696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409409.488824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409409.686947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409409.841537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409410.056260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409410.217074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409410.357003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409410.466126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409410.605320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409410.736730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409410.874309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409411.005829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409411.134977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409411.279935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409411.401221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409411.514664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409411.640791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409411.777537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409411.902832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409412.031965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409412.176189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409412.300431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409412.449793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409412.560131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409412.683596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409412.820015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409412.951929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409413.197543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409413.328431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409413.469753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409413.615701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409413.732064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409413.867727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409414.004411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409414.129915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409414.256843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409414.382692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409414.511465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409414.638359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409414.762918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409414.891810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409415.019094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409415.143527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409415.281585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409415.398526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409415.527946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409415.656025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409415.794606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409415.933675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409416.077309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409416.209598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409416.346109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409416.452901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409416.589118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409416.714483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409416.837337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409416.966977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409417.091884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409417.228889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409417.360449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409417.487889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409417.613992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409417.741577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409417.875624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409418.000003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409418.126983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409418.280966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409418.406979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409418.532127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409418.655750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409418.782522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409418.917634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409419.052344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409419.197236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409419.311546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409419.439748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409419.573247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409419.721162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409419.836786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409419.960057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409420.107542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409420.217039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409420.361374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409420.481221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409420.614345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409420.748116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409420.874608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409421.012861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409421.149017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409421.264898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409421.386701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409421.530982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409421.665961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409421.784566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409421.930048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409422.065172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409422.194068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409422.322837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409422.441317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409422.573726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409422.713297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409422.820333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409422.945637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409423.074766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409423.195051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409423.331918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409423.454894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409423.581447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409423.722461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409423.868381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409423.990444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409424.126500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409424.261042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409424.382152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409424.504525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409424.627487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409424.776377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409424.886552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409425.009478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409425.136725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409425.260471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409425.388157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409425.511518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409425.635714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409425.759792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409425.886415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409426.007596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409426.140861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409426.276946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409426.387083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409426.519765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409426.638697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409426.768883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409426.887608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409427.010103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409427.137132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409427.262276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409427.392015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409427.517235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409427.673113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409427.787726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409427.923876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409428.043162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409428.176710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409428.306770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409428.432302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409428.557334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409428.683100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409428.810820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409428.943467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409429.076942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409429.202070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409429.321061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409429.443098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409429.577584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409429.714778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409429.831931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409429.954706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409430.080937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409430.217831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409430.352786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409430.485065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409430.617985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409430.750536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409430.879241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409431.003316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409431.124008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409431.274561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409431.382839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409431.511678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409431.642375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409431.770405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409431.902271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409432.033490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409432.153279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409432.297526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409432.429084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409432.589712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409432.696481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409432.820173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409432.941878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409433.068337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409433.194782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409433.337745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409433.452332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409433.576967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409433.715993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409433.851739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409433.995022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409434.142596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409434.249431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409434.391432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409434.516135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409434.642898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409434.758963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409434.885365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409435.008851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409435.148944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409435.267235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409435.394243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409435.529096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409435.648898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409435.805459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409435.939960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409436.066951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409436.196419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409436.320952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409436.449054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409436.570547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409436.699341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409436.823500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409436.946764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409437.071119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409437.201330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409437.331728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409437.466498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409437.584162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409437.707691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409437.842282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409437.975083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409438.117541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409438.239541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409438.367464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409438.496174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409438.631202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409438.753330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409438.881328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409439.008589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409439.135704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409439.257822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409439.384045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409439.514217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409439.653426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409439.785044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409439.903776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409440.048108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409440.178828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409440.309027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409440.437333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409440.560139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409440.683275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409440.816706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409440.942346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409441.083605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409441.196551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409441.325024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409441.446728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409441.570693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409441.703192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409441.836691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409441.973922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409442.086575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409442.213630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409442.343588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409442.479237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409442.623126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409442.742586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409442.874737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409443.004109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409443.122701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409443.258002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409443.377465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409443.505919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409443.633020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409443.755547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409443.902543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409444.023240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409444.137006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409444.271629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409444.386029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409444.524722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409444.639883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409444.762223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409444.888776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409445.010113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409445.150641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409445.259617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409445.387098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409445.524389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409445.639576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409445.768855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409445.898340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409446.042925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409446.161751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409446.297858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409446.426327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409446.559303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409446.689741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409446.809609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409446.961365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409447.072346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409447.205837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409447.327270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409447.454357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409447.576942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409447.706068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409447.835462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409447.977950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409448.113439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409448.261991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409448.382256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409448.513051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409448.640624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409448.762069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409448.887471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409449.027296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409449.139519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409449.278032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409449.401657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409449.550823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409449.678026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409449.807796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409449.932216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409450.067691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409450.186857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409450.319097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409450.444400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409450.568063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409450.692085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409450.819078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409450.947185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409451.075535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409451.200910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409451.339438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409451.452350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409451.575573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409451.719711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409451.860998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409451.987737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409452.118506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409452.250103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409452.364864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409452.492679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409452.630344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409452.742955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409452.877660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409453.004952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409453.132631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409453.261998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409453.379633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409453.505640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409453.648004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409453.759956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409453.886292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409454.026426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409454.151908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409454.282092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409454.415871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409454.545235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409454.691328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409454.821342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409454.945965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409455.073338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409455.199921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409455.321560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409455.445579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409455.569054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409455.696792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409455.822354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409455.947672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409456.070246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409456.204251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409456.337540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409456.487083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409456.597619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409456.717769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409456.855495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409456.994522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409457.120429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409457.259095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409457.377879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409457.506970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409457.633173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409457.753793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409457.898062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409458.020334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409458.140227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409458.273349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409458.413304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409458.544234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409458.662143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409458.805362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409458.932774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409459.053339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409459.180250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409459.302475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409459.436211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409459.561910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409459.683381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409459.816891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409459.941802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409460.070533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409460.192436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409460.320513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409460.445768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409460.565683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409460.690370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409460.818893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409460.939481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409461.086087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409461.202296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409461.331139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409461.462725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409461.582954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409461.727129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409461.852304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409461.977296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409462.114768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409462.241967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409462.371251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409462.495441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409462.622224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409462.740101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409462.876685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409462.994426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409463.130677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409463.254875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409463.382365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409463.507680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409463.635244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409463.767398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409463.887335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409464.008056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409464.136244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409464.259302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409464.387131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409464.508429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409464.626250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409464.755970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409464.878232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409465.010670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409465.142002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409465.266496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409465.386976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409465.510068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409465.644499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409465.775836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409465.909113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409466.049024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409466.172142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409466.312655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409466.447793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409466.626978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409466.779970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409466.903026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409467.048800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409467.155107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409467.295163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409467.431618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409467.568089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409467.681157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409467.824804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409467.937687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409468.074708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409468.192465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409468.336633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409468.446501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409468.578469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409468.703380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409468.839283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409468.961033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409469.092220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409469.219988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409469.348048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409469.483451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409469.616961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409469.755539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409469.870988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409469.998013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409470.128963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409470.251190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409470.380283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409470.574833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409470.712708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409470.829716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409470.948173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409471.086855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409471.243920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409471.368289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409471.489009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409471.638938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409471.754970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409471.877511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409472.010091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409472.137167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409472.260079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409472.394219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409472.510481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409472.630977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409472.760094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409472.897047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409473.017763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409473.147152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409473.278335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409473.412448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409473.548057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409473.678322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409473.813431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409473.947326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409474.063775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409474.198261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409474.321957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409474.443604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409474.576663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409474.712143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409474.830321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409474.962792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409475.103796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409475.242407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409475.367436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409475.503846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409475.648769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409475.763448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409475.891610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409476.015316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409476.149931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409476.277219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409476.421306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409476.529492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409476.672196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409476.801196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409476.944123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409477.064540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409477.194559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409477.313130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409477.445426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409477.570343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409477.696045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409477.831021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409477.954221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409478.095965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409478.219299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409478.361583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409478.496309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409478.634969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409478.760452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409478.886210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409479.008187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409479.151746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409479.260670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409479.385894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409479.508844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409479.629856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409479.779576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409479.922821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409480.057279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409480.182543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409480.314634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409480.441058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409480.568928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409480.691805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409480.825243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409480.939801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409481.074922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409481.193562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409481.319912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409481.439092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409481.571074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409481.713026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409481.859526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409481.995624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409482.128415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409482.262091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409482.383333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409482.515098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409482.631138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409482.762991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409482.887480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409483.015679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409483.149194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409483.289565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409483.438780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409483.563087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409483.696350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409483.828117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409483.961980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409484.089761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409484.215737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409484.366759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409484.487589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409484.616055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409484.745264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409484.869881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409485.001938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409485.126452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409485.258752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409485.381221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409485.508635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409485.629431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409485.754829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409485.875366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409486.006596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409486.130795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409486.267265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409486.386679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409486.516059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409486.637039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409486.776920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409486.898778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409487.028710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409487.149803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409487.299864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409487.423856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409487.564873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409487.686751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409487.813220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409487.940700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409488.063244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409488.187550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409488.321892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409488.444514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409488.572973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409488.695628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409488.816522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409488.943436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409489.075955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409489.202893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409489.358501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409489.467571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409489.595167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409489.730968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409489.864353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409490.000000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409490.128728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409490.247215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409490.377942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409490.516835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409490.631567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409490.755985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409490.883323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409491.000258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409491.149940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409491.255681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409491.409761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409491.514881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409491.639463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409491.768450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409491.902742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409492.026387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409492.164125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409492.306957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409492.448880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409492.570678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409492.691381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409492.824314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409492.947942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409493.072556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409493.193974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409493.313576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409493.450009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409493.586774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409493.698860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409493.831410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409493.983045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409494.095521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409494.232662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409494.368122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409494.496247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409494.630052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409494.761763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409494.879905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409495.007009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409495.141287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409495.265498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409495.382502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409495.507462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409495.636241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409495.772700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409495.900098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409496.043889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409496.171803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409496.306989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409496.440878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409496.570804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409496.695899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409496.828274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409496.952155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409497.070781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409497.194817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409497.323181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409497.442895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409497.576087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409497.705795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409497.841274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409497.956736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409498.079904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409498.211272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409498.343413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409498.477176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409498.608683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409498.743363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409498.880478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409499.009072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409499.131625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409499.262546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409499.379008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409499.503525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409499.635590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409499.757301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409499.882195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409500.011782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409500.142970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409500.265263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409500.394636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409500.525029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409500.672828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409500.811174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409500.930737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409501.070408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409501.212243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409501.321412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409501.448851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409501.574958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409501.699129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409501.828324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409501.961559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409502.086362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409502.236082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409502.364319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409502.490288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409502.616033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409502.753098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409502.871103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409502.999779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409503.128010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409503.262900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409503.375211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409503.499542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409503.631562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409503.759528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409503.885700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409504.013082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409504.135444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409504.277673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409504.391619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409504.523654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409504.670706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409504.793001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409504.926363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409505.048164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409505.182705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409505.317185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409505.437704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409505.573134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409505.688524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409505.844171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409505.945526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409506.094486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409506.201862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409506.340899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409506.462040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409506.609263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409506.742902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409506.875921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409506.995039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409507.123440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409507.254588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409507.384357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409507.519674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409507.623425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409507.758917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409507.896426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409508.011258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409508.132407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409508.263877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409508.396172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409508.528967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409508.667992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409508.794526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409508.936877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409509.069053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409509.189624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409509.316659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409509.444092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409509.565588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409509.714133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409509.820317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409509.940997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409510.090219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409510.199032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409510.328213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409510.451883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409510.577235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409510.704218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409510.842448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409510.966692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409511.110217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409511.253516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409511.373360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409511.505209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409511.639675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409511.774101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409511.883831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409512.007571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409512.142457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409512.280655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409512.409870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409512.556632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409512.682143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409512.811105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409512.941518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409513.069684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409513.189835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409513.329688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409513.455686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409513.573244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409513.709110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409513.838342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409513.980317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409514.108794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409514.247584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409514.381313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409514.506445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409514.635459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409514.767103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409514.895572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409515.018462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409515.164734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409515.292028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409515.425025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409515.553311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409515.680851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409515.814175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409515.936533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409516.068324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409516.204255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409516.341863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409516.462351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409516.586876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409516.733443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409516.855276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409517.003102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409517.118739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409517.252605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409517.373744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409517.516236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409517.628791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409517.755090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409517.878802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409518.022590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409518.132824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409518.259836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409518.393708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409518.524836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409518.659593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409518.793743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409518.941048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409519.064444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409519.191644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409519.319870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409519.444125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409519.568202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409519.691876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409519.821711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409519.948972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409520.070806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409520.201889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409520.323111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409520.449250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409520.575979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409520.698602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409520.830240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409520.945704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409521.083700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409521.204620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409521.328884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409521.453516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409521.585517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409521.714763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409521.850359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409521.988553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409522.112252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409522.241603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409522.383943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409522.509177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409522.637612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409522.755222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409522.913083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409523.019131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409523.152507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409523.281049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409523.425025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409523.559151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409523.692131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409523.819682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409523.963886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409524.085592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409524.188220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409524.321711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409524.460423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409524.588915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409524.731231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409524.844067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409524.980303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409525.112608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409525.243576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409525.375815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409525.504224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409525.627319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409525.752696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409525.883372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409526.002065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409526.126091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409526.253259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409526.379759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409526.503458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409526.762360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409527.074236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409527.325860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409527.572579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409527.764381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409527.965912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409528.102435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409528.314102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409528.463380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409528.651754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409528.825585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409529.009825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409529.181074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409529.336430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409529.574346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409529.703658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409529.867363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409530.083820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409530.245604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409530.375951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409530.572914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409530.704370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409530.887249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409531.133987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409531.262787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409531.395246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409531.517709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409531.652267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409531.783250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409531.925883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409532.060715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409532.190546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409532.312059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409532.438745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409532.567460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409532.705980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409532.816919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409532.953015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409533.069713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409533.213214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409533.317036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409533.468147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409533.567660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409533.699516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409533.822290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409533.949154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409534.131480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409534.323914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409534.444732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409534.576688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409534.710065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409534.836583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409534.964530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409535.086080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409535.214416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409535.361199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409535.492218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409535.625852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409535.756434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409535.890301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409536.009683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409536.136971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409536.261755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409536.406411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409536.514939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409536.650896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409536.781877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409536.907992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409537.046762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409537.174185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409537.296907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409537.432991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409537.553340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409537.695419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409537.818183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409537.947856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409538.072522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409538.201800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409538.323785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409538.457587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409538.575488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409538.702503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409538.829147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409538.959396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409539.080110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409539.215151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409539.358880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409539.496669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409539.616182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409539.760609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409539.902764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409540.014008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409540.138292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409540.265672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409540.387964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409540.514153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409540.645002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409540.775918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409540.912477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409541.030398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409541.166837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409541.308531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409541.429292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409541.567775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409541.698810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409541.839283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409541.952805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409542.075902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409542.201949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409542.343846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409542.460801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409542.592153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409542.709545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409542.837422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409542.974997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409543.108202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409543.244490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409543.371325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409543.494336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409543.616096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409543.748579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409543.881199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409544.021875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409544.135798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409544.273902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409544.386994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409544.511844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409544.639249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409544.766172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409544.898002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409545.022662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409545.167775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409545.287800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409545.434983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409545.556705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409545.701616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409545.808710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409545.946512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409546.065432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409546.205039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409546.318376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409546.446797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409546.571118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409546.702918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409546.813081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409546.943994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409547.071616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409547.201420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409547.337983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409547.460039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409547.588381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409547.718907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409547.855617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409547.989868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409548.115881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409548.247378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409548.384908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409548.496319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409548.620112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409548.757607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409548.894194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409549.008544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409549.131510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409549.264498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409549.379814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409549.510885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409549.630269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409549.760023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409549.885826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409550.020430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409550.150539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409550.271856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409550.403053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409550.543707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409550.677460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409550.808710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409550.934964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409551.066146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409551.191096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409551.317992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409551.439479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409551.582329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409551.692356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409551.822615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409551.947777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409552.078239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409552.218486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409552.337347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409552.463015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409552.584398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409552.708075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409552.837180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409552.967362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409553.105934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409553.225299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409553.366330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409553.486098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409553.637849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409553.764742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409553.881027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409554.020698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409554.148490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409554.252914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409554.375839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409554.509480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409554.713560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409554.880843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409555.091019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409555.236585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409555.412992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409555.547721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409555.727801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409555.862553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409556.026111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409556.184294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409556.358917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409556.503452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409556.673191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409556.822863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409556.986258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409557.144528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409557.279256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409557.433354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409557.565827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409557.715042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409557.885536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409558.021519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409558.194884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409558.323979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409558.530247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409558.655776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409558.895144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409559.068974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409559.212512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409559.402801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409559.519667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409559.662988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409559.825193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409559.982419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409560.124891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409560.246553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409560.378451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409560.507752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409560.637202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409560.760971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409560.892210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409561.014210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409561.142700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409561.272322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409561.412863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409561.527377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409561.664944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409561.796986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409561.939960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409562.061864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409562.193769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409562.318482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409562.445624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409562.577939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409562.717486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409562.844930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409562.981160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409563.116628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409563.253366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409563.384594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409563.505706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409563.625696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409563.766026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409563.880366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409564.004696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409564.140839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409564.275104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409564.399428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409564.551237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409564.655429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409564.791249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409564.925788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409565.066652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409565.181125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409565.332680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409565.441617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409565.568479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409565.697956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409565.834051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409565.960896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409566.087966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409566.217491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409566.356715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409566.490582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409566.635131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409566.756110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409566.880225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409567.013126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409567.132110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409567.255846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409567.384855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409567.510473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409567.635968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409567.763436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409567.906188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409568.012606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409568.145808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409568.279360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409568.410972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409568.547692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409568.674244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409568.812803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409568.950661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409569.066149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409569.190237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409569.324180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409569.447069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409569.574212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409569.704298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409569.827947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409569.957242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409570.076914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409570.211251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409570.338372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409570.481331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409570.605660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409570.755605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409570.873702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409571.006330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409571.147593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409571.260231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409571.384161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409571.507868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409571.637436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409571.782971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409571.921799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409572.059171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409572.182286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409572.309529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409572.429853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409572.563711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409572.684746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409572.807921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409572.938281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409573.066219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409573.188645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409573.313106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409573.447360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409573.566654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409573.685905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409573.813130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409573.942148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409574.070484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409574.191390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409574.319667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409574.446854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409574.564441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409574.701599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409574.820307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409574.947334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409575.077100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409575.204294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409575.332086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409575.461040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409575.588570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409575.712956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409575.844587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409575.980292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409576.108391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409576.233301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409576.363930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409576.492270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409576.624826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409576.743839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409576.876516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409577.004111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409577.124220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409577.248257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409577.384202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409577.505176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409577.634429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409577.763739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409577.886393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409578.015085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409578.140865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409578.264535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409578.396563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409578.524544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409578.658583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409578.793096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409578.921304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409579.058785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409579.188923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409579.313962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409579.454768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409579.563664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409579.691234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409579.821869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409579.949658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409580.075715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409580.206714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409580.357305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409580.479505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409580.602711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409580.766194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409580.875230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409581.003044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409581.127065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409581.276225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409581.388776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409581.526258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409581.639712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409581.766580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409581.890845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409582.024715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409582.167493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409582.304384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409582.422824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409582.555811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409582.685522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409582.806416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409582.932688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409583.063077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409583.204129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409583.314898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409583.444304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409583.570989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409583.696515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409583.824480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409583.957556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409584.092284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409584.211523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409584.338485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409584.480698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409584.612574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409584.737059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409584.866638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409584.991667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409585.126805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409585.250859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409585.379096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409585.552466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409585.684732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409585.806690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409585.948437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409586.073684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409586.210663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409586.335308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409586.467131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409586.592381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409586.735791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409586.863629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409586.990325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409587.111107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409587.248713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409587.375699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409587.493625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409587.623976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409587.761207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409587.900397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409588.021925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409588.140971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409588.294645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409588.420163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409588.549995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409588.678935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409588.808676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409588.930551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409589.062256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409589.191548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409589.320207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409589.446389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409589.567533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409589.689050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409589.817917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409589.947774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409590.069952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409590.195930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409590.325782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409590.445624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409590.575117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409590.699036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409590.834773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409590.962608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409591.108862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409591.217861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409591.356718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409591.484015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409591.599208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409591.741941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409591.881311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409592.009587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409592.146961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409592.284332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409592.397690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409592.538102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409592.676973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409592.787703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409592.922287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409593.055093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409593.184896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409593.315637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409593.440804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409593.563385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409593.697773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409593.818345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409593.946331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409594.074015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409594.205697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409594.336770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409594.475519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409594.615674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409594.747571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409594.864549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409594.993645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409595.124078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409595.253243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409595.377346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409595.504301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409595.630963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409595.752399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409595.879767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409596.006236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409596.136101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409596.258535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409596.385188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409596.513339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409596.646114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409596.773009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409596.902866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409597.025112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409597.155465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409597.286494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409597.415935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409597.545930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409597.680406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409597.815353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409597.930074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409598.087496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409598.202516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409598.322037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409598.467450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409598.602207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409598.727287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409598.858496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409598.987740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409599.136615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409599.256292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409599.379702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409599.504528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409599.634298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409599.772381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409599.900733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409600.022896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409600.182177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409600.308483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409600.437783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409600.627945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409600.769001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409600.877908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409601.011828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409601.133285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409601.257271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409601.388351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409601.511799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409601.648198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409601.799361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409601.922137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409602.052694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409602.186306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409602.312931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409602.431565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409602.562837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409602.687253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409602.822023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409602.948181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409603.073341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409603.195357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409603.320402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409603.449756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409603.568780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409603.710754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409603.837197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409603.967610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409604.086828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409604.217849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409604.353641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409604.481958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409604.609137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409604.738588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409604.864700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409604.983630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409605.122268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409605.240451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409605.374700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409605.493075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409605.632142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409605.754008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409605.898430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409606.005012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409606.141003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409606.256005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409606.382271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409606.511667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409606.640137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409606.758622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409606.913186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409607.020338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409607.145308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409607.277941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409607.403304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409607.529347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409607.682850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409607.811779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409607.930781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409608.053056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409608.194873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409608.309059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409608.436918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409608.554786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409608.691555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409608.816847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409608.940992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409609.075366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409609.197019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409609.311063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409609.452626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409609.554635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409609.699125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409609.817656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409609.944432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409610.064568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409610.194055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409610.320242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409610.442104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409610.570437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409610.698088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409610.827659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409610.944826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409611.070674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409611.200947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409611.322035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409611.450541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409611.569769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409611.717047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409611.839799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409611.944558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409612.073534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409612.225248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409612.342670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409612.487382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409612.613958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409612.748637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409612.877122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409613.002101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409613.129597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409613.255794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409613.382334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409613.513465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409613.632763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409613.754467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409613.881531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409614.010055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409614.131623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409614.255876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409614.389831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409614.502526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409614.624133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409614.757631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409614.873344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409615.021818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409615.129953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409615.260301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409615.377933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409615.563332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409615.675327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409615.807424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409615.944646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409616.065110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409616.191906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409616.319523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409616.434475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409616.583785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409616.690544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409616.832052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409616.945972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409617.074579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409617.208110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409617.335649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409617.456874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409617.604135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409617.728986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409617.862678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409617.980917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409618.107959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409618.234039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409618.372114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409618.496754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409618.618904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409618.748412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409618.881660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409619.000006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409619.136032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409619.262315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409619.383562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409619.507556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409619.634947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409619.755246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409619.890424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409620.015226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409620.145360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409620.272360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409620.404477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409620.531985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409620.682091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409620.804017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409620.932034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409621.062871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409621.188753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409621.314786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409621.445754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409621.568345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409621.699443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409621.825560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409621.950381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409622.074355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409622.218004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409622.335792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409622.460747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409622.590635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409622.723831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409622.852109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409622.983760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409623.123568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409623.275028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409623.424826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409623.565746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409623.684793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409623.819468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409623.948947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409624.066478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409624.194754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409624.314084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409624.442014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409624.561990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409624.688252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409624.826575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409624.937910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409625.073147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409625.196621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409625.346730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409625.470047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409625.621083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409625.729645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409625.861175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409625.995831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409626.127565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409626.246705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409626.379752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409626.501940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409626.631587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409626.755112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409626.884779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409627.007787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409627.137498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409627.260275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409627.393777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409627.511845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409627.643107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409627.785495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409627.919834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409628.031259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409628.182498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409628.307315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409628.429581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409628.552617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409628.676796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409628.807622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409628.938649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409629.069956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409629.190263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409629.311830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409629.437719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409629.566556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409629.692243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409629.815993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409629.942955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409630.063016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409630.194001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409630.318377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409630.445650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409630.582862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409630.697589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409630.821135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409630.956638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409631.076948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409631.210596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409631.345845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409631.474287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409631.606466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409631.751467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409631.879196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409632.006217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409632.128285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409632.267744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409632.387100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409632.518772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409632.648382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409632.773498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409632.903348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409633.022809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409633.161740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409633.296359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409633.435161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409633.566810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409633.686852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409633.825855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409633.949675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409634.086641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409634.205780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409634.332780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409634.457822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409634.587220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409634.709158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409634.849212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409634.980510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409635.112682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409635.237101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409635.372894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409635.509763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409635.626053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409635.755005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409635.875653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409636.009886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409636.126148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409636.255017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409636.392624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409636.501742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409636.628242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409636.764147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409636.876315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409637.004419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409637.144580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409637.253158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409637.372006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409637.500304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409637.631709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409637.755895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409637.880079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409638.003384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409638.129335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409638.269038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409638.385560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409638.509977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409638.646451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409638.788578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409638.897528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409639.039659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409639.182781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409639.301062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409639.427431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409639.550820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409639.679698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409639.811493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409639.943091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409640.070553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409640.186256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409640.309363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409640.439875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409640.566546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409640.691604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409640.819139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409640.957549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409641.064996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409641.182974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409641.316510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409641.446570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409641.572048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409641.700002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409641.831778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409641.972986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409642.107124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409642.233795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409642.361594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409642.492663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409642.630341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409642.753839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409642.876497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409643.002815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409643.124775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409643.252597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409643.379590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409643.509305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409643.634507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409643.770114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409643.882532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409644.011105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409644.131153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409644.273626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409644.393867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409644.532770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409644.666555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409644.815659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409644.932400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409645.064085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409645.188478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409645.315130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409645.436527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409645.565693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409645.684826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409645.829573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409645.947891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409646.073517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409646.204874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409646.335212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409646.473997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409646.626733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409646.741685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409646.871961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409647.001215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409647.130269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409647.249913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409647.414055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409647.695903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409648.068651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409648.259588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409648.494873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409648.647408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409648.813037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409649.021891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409649.175626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409649.332996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409649.509453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409649.712127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409649.919228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409650.062955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409650.278993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409650.425188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409650.581506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409650.772259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409650.932565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409651.084670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409651.260952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409651.437823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409651.607283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409651.845724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409652.001426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409652.125106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409652.250343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409652.374943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409652.502567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409652.626368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409652.752742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409652.874354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409653.001546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409653.144150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409653.269684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409653.378356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409653.501221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409653.627484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409653.756452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409653.892490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409654.017795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409654.159487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409654.292413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409654.427565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409654.553926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409654.685299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409654.858657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409655.066937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409655.184562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409655.334078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409655.432687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409655.570586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409655.693857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409655.819239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409655.954012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409656.072079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409656.203681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409656.322026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409656.445612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409656.570756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409656.699492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409656.824691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409656.946219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409657.073210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409657.196921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409657.330452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409657.457970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409657.596226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409657.717797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409657.870098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409657.989215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409658.125231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409658.245166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409658.372459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409658.510660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409658.628053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409658.753793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409658.874111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409658.992307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409659.139765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409659.253709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409659.396076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409659.503731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409659.641968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409659.760696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409659.884400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409660.022451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409660.177797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409660.301536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409660.427937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409660.557918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409660.692232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409660.812565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409660.941243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409661.071398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409661.198021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409661.323884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409661.455409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409661.594666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409661.758511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409661.870000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409662.000990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409662.132752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409662.258496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409662.382710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409662.516179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409662.636294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409662.762671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409662.889228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409663.023099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409663.151663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409663.297269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409663.417761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409663.552911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409663.692523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409663.823608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409663.953884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409664.079665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409664.206927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409664.346099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409664.483008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409664.612612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409664.726274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409664.866223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409664.986254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409665.126891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409665.240323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409665.369963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409665.503000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409665.635215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409665.757536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409665.888262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409666.034189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409666.146675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409666.285233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409666.410550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409666.542870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409666.671775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409666.799537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409666.933045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409667.052726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409667.186011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409667.319151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409667.457510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409667.560097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409667.686378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409667.823659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409667.959930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409668.090123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409668.255208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409668.379412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409668.503478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409668.631757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409668.756663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409668.884015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409669.020346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409669.147081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409669.280227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409669.425121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409669.556215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409669.685030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409669.818729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409669.934532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409670.059410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409670.188970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409670.311265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409670.436586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409670.569849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409670.691043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409670.814764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409670.936409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409671.064426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409671.184081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409671.311228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409671.433204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409671.564159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409671.692808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409671.819452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409671.944788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409672.071375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409672.187118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409672.313970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409672.445825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409672.597595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409672.703913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409672.838859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409672.976026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409673.096046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409673.230097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409673.353969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409673.492336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409673.622832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409673.751761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409673.879010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409674.003854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409674.130423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409674.252245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409674.377280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409674.505204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409674.645861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409674.750916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409674.875544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409675.005530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409675.126699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409675.259353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409675.389110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409675.518654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409675.644915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409675.794672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409675.929981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409676.052373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409676.192812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409676.307571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409676.439353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409676.557014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409676.688929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409676.821207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409676.946454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409677.071388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409677.222576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409677.357590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409677.476695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409677.618197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409677.740135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409677.865272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409677.989255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409678.123281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409678.245888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409678.369802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409678.504823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409678.628417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409678.762105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409678.879296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409678.995473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409679.144176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409679.277421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409679.392591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409679.523520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409679.656511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409679.802599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409679.914838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409680.061357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409680.187593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409680.312598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409680.428884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409680.565359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409680.680208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409680.805748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409680.935653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409681.065076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409681.193955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409681.313503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409681.440552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409681.570614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409681.692724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409681.818649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409681.949209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409682.073619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409682.230464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409682.340749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409682.473150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409682.609743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409682.734272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409682.877640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409682.994011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409683.124797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409683.254369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409683.375651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409683.509882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409683.632287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409683.757208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409683.893932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409684.014502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409684.148743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409684.273630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409684.409506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409684.539251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409684.669857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409684.795792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409684.927031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409685.053801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409685.185529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409685.303321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409685.426875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409685.549513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409685.681632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409685.811858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409685.935904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409686.061635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409686.291681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409686.445486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409686.616357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409686.738807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409686.874968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409686.998064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409687.144263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409687.256849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409687.380328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409687.501717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409687.630664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409687.757830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409687.891550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409688.021374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409688.148971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409688.276056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409688.407383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409688.546442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409688.671649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409688.794424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409688.936563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409689.058974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409689.192258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409689.307248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409689.440676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409689.562861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409689.690498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409689.813837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409689.940137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409690.063408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409690.188905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409690.314956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409690.456039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409690.555052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409690.693727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409690.812724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409690.945099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409691.065372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409691.192805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409691.323846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409691.455286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409691.585633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409691.747635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409691.870402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409691.994606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409692.123396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409692.253859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409692.373597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409692.513821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409692.637296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409692.758370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409692.884360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409693.017204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409693.147826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409693.293514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409693.414621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409693.549869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409693.666390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409693.792640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409693.935613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409694.061321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409694.190065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409694.316143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409694.442690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409694.565507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409694.706409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409694.831045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409694.936020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409695.069324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409695.192698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409695.324575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409695.444708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409695.581198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409695.710142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409695.840756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409695.987983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409696.105478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409696.230638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409696.366640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409696.490086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409696.632596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409696.748359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409696.871206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409697.011872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409697.130770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409697.258461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409697.385966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409697.504270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409697.628754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409697.760561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409697.890054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409698.016246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409698.145638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409698.287919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409698.422900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409698.558859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409698.687096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409698.808648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409698.939055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409699.060874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409699.189939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409699.306484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409699.443057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409699.562607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409699.691443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409699.814179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409699.942869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409700.068214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409700.203579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409700.334393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409700.463289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409700.594562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409700.728152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409700.858904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409700.983568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409701.110626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409701.234782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409701.358276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409701.484116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409701.626435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409701.752323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409701.877833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409702.020798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409702.124784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409702.289147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409702.405317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409702.540066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409702.672432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409702.817289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409702.946335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409703.056156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409703.196791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409703.310158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409703.433473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409703.585731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409703.712752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409703.832366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409703.949018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409704.080210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409704.230448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409704.347416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409704.479134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409704.623671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409704.746956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409704.872082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409704.992879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409705.128368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409705.248548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409705.375054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409705.494987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409705.625723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409705.750704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409705.877743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409706.003374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409706.128115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409706.260753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409706.386752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409706.531597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409706.641741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409706.776641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409706.901676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409707.040906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409707.175394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409707.302602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409707.427633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409707.557495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409707.692366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409707.814459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409707.943508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409708.062416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409708.208647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409708.330222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409708.469364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409708.596556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409708.708843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409708.856727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409708.991481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409709.114892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409709.248753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409709.377692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409709.499938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409709.623347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409709.759887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409709.893717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409710.036688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409710.148069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409710.289834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409710.427029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409710.544319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409710.672175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409710.810957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409710.935205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409711.062261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409711.183994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409711.330767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409711.439816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409711.568051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409711.704906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409711.821166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409711.949245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409712.083093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409712.198250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409712.330547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409712.456724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409712.588392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409712.717169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409712.867602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409712.995203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409713.128840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409713.251484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409713.382082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409713.497538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409713.626355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409713.750983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409713.874814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409713.995335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409714.134182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409714.272309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409714.390757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409714.507998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409714.661858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409714.786992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409714.905060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409715.046688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409715.173074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409715.300815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409715.433683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409715.551491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409715.680025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409715.807113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409715.938941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409716.062251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409716.192470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409716.311346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409716.431977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409716.560277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409716.703439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409716.810327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409716.940899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409717.061735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409717.187875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409717.314650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409717.454324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409717.559170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409717.687119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409717.830619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409717.964945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409718.084188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409718.218986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409718.355088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409718.479170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409718.605962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409718.734077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409718.868921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409718.994711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409719.118849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409719.242148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409719.369539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409719.498399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409719.614432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409719.753315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409719.872544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409720.010683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409720.124778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409720.243942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409720.373672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409720.507523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409720.624957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409720.753614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409720.875087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409721.008796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409721.128523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409721.258115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409721.391919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409721.522773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409721.651708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409721.804842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409721.929286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409722.060502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409722.180599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409722.315086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409722.435879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409722.563021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409722.683756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409722.810472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409722.939706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409723.058699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409723.184688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409723.322875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409723.434557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409723.565455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409723.693062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409723.827972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409723.960275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409724.090683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409724.219267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409724.371124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409724.495150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409724.625793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409724.749235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409724.876834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409724.995302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409725.119646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409725.245080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409725.369792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409725.505907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409725.624101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409725.753646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409725.879747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409725.998282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409726.133198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409726.257461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409726.392431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409726.520330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409726.664357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409726.790820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409726.932779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409727.052084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409727.182287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409727.315261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409727.430289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409727.549368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409727.680321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409727.813674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409727.938673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409728.060967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409728.208157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409728.329009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409728.445333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409728.570925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409728.695331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409728.837685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409728.947945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409729.072234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409729.205018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409729.329673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409729.468189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409729.581925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409729.714445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409729.854586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409729.984218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409730.103975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409730.229070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409730.361540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409730.494887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409730.611012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409730.741100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409730.864532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409730.993204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409731.116423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409731.248477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409731.371635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409731.491875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409731.623034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409731.744270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409731.874043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409731.996737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409732.124636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409732.255612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409732.385582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409732.523811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409732.641317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409732.769668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409732.907596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409733.043410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409733.183879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409733.303543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409733.429931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409733.559988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409733.673049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409733.809627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409733.930983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409734.062492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409734.188843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409734.327404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409734.439931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409734.570141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409734.691650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409734.818068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409734.945175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409735.074600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409735.201987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409735.348655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409735.463895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409735.580731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409735.735169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409735.867621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409735.989216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409736.109355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409736.242533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409736.369572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409736.509552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409736.627116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409736.748541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409736.886642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409737.005135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409737.140694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409737.267735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409737.399301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409737.517371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409737.661644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409737.789904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409737.933917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409738.057668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409738.193691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409738.311502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409738.441615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409738.561541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409738.688782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409738.815987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409738.946701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409739.066879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409739.202829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409739.319233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409739.452042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409739.583709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409739.699424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409739.827487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409739.972718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409740.092942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409740.228093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409740.364440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409740.495157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409740.615014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409740.747009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409740.878416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409741.015397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409741.119537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409741.247245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409741.392308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409741.507589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409741.642983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409741.754427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409741.876156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409742.004048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409742.128746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409742.261180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409742.386362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409742.533334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409742.645586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409742.782525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409742.913985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409743.042496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409743.173263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409743.299618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409743.431322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409743.559421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409743.688032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409743.816336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409743.940608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409744.065688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409744.186680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409744.319734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409744.441228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409744.569614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409744.693571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409744.820472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409744.942590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409745.066526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409745.188189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409745.315567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409745.443752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409745.584853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409745.726940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409745.839754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409745.956279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409746.099530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409746.227801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409746.367805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409746.496522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409746.617439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409746.737029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409746.875113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409746.998633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409747.124382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409747.252492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409747.376131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409747.493621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409747.620740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409747.753562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409747.884911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409748.011307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409748.145260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409748.292233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409748.414955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409748.538492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409748.663865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409748.801217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409748.930881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409749.059704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409749.188611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409749.316513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409749.442671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409749.577951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409749.690074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409749.814087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409749.941597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409750.061877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409750.190416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409750.309876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409750.438597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409750.564237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409750.699177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409750.827540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409750.992297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409751.097280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409751.240624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409751.364706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409751.490688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409751.633003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409751.772189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409751.880702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409752.017307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409752.143777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409752.280482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409752.413024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409752.538656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409752.674336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409752.810707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409752.929828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409753.067437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409753.188978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409753.317861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409753.446480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409753.582260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409753.691201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409753.842599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409753.960208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409754.094023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409754.225765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409754.346052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409754.478020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409754.614899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409754.738479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409754.870665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409754.995543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409755.129722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409755.258639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409755.385923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409755.511096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409755.645199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409755.781574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409755.919971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409756.041182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409756.167344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409756.295459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409756.426396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409756.550129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409756.676459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409756.800484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409756.948417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409757.058134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409757.186233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409757.315212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409757.437348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409757.558093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409757.689823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409757.814943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409757.939830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409758.062045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409758.192008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409758.316357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409758.436771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409758.565632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409758.693919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409758.830467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409758.942215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409759.066136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409759.205896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409759.331128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409759.475357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409759.599963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409759.730245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409759.873108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409760.001772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409760.116958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409760.244988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409760.377239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409760.513430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409760.618529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409760.749824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409760.868547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409761.005085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409761.131229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409761.249835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409761.384105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409761.496359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409761.623980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409761.757318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409761.873554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409761.999952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409762.127034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409762.277673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409762.385497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409762.519516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409762.643941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409762.774542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409762.910581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409763.027510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409763.182226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409763.308467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409763.438674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409763.555104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409763.683493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409763.804481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409763.926780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409764.050511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409764.192147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409764.317615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409764.432691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409764.560315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409764.684017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409764.815922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409764.935582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409765.067304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409765.190741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409765.318908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409765.442127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409765.578831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409765.701992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409765.850181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409765.981452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409766.112075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409766.246970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409766.371814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409766.483038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409766.616493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409766.737495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409766.859690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409767.007757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409767.116465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409767.243673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409767.381605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409767.493139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409767.622117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409767.751221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409767.892749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409768.136285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409768.502802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409768.713667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409768.940442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409769.123638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409769.305298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409769.452015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409769.649146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409769.851175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409769.982299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409770.169184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409770.345688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409770.519600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409770.719841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409770.914913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409771.049117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409771.202949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409771.381548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409771.552484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409771.740484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409771.915701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409772.061409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409772.286598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409772.475217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409772.653841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409772.769290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409772.891456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409773.037985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409773.170304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409773.294935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409773.427129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409773.559777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409773.685603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409773.811682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409773.936385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409774.062254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409774.187254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409774.313016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409774.440080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409774.563143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409774.690952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409774.819394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409774.940029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409775.063801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409775.193644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409775.327263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409775.472424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409775.652192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409775.816353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409775.946711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409776.082886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409776.202059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409776.331450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409776.456475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409776.593277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409776.710726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409776.853318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409776.977156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409777.103622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409777.224349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409777.370052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409777.479437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409777.624190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409777.734443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409777.872379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409777.996929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409778.117048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409778.265580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409778.371471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409778.491690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409778.614995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409778.746657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409778.872229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409778.992663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409779.131114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409779.249649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409779.379127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409779.502331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409779.639338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409779.766595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409779.913595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409780.041365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409780.173095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409780.304911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409780.429368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409780.552992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409780.684003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409780.827515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409780.953825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409781.078648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409781.203700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409781.331653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409781.464653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409781.594471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409781.762468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409781.889565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409781.990939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409782.123492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409782.254465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409782.374652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409782.499213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409782.625045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409782.759231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409782.900947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409783.019567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409783.140686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409783.269807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409783.415245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409783.558966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409783.685298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409783.811529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409783.934935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409784.061277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409784.184420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409784.311454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409784.429918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409784.555657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409784.676353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409784.825284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409784.925978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409785.053123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409785.184601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409785.329018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409785.452998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409785.567365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409785.693999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409785.827675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409785.951435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409786.117550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409786.217486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409786.340640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409786.480885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409786.615495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409786.735758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409786.873666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409786.999032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409787.125004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409787.265072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409787.374601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409787.493011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409787.628233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409787.758677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409787.887470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409788.006148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409788.148503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409788.268009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409788.392947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409788.519225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409788.651550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409788.799816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409788.909540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409789.052948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409789.184145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409789.304925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409789.436169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409789.561520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409789.692176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409789.809443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409789.938373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409790.061983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409790.205908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409790.316521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409790.450019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409790.580534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409790.706251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409790.834623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409790.971492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409791.106917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409791.246899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409791.367007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409791.499990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409791.612455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409791.746362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409791.869522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409791.996008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409792.115584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409792.250798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409792.373774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409792.502565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409792.636933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409792.755165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409792.895492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409793.024307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409793.142551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409793.264713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409793.390548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409793.535668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409793.666864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409793.790880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409793.920954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409794.055302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409794.173673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409794.303921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409794.429492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409794.557280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409794.682992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409794.810566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409794.925435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409795.055942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409795.187293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409795.307537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409795.432494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409795.562300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409795.690625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409795.819187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409795.945865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409796.081301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409796.220862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409796.363135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409796.486054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409796.616791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409796.734495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409796.868688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409796.994901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409797.121312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409797.255530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409797.378466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409797.508665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409797.629497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409797.764602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409797.888433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409798.004317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409798.141848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409798.285655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409798.412663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409798.536412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409798.664939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409798.800922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409798.932057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409799.055810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409799.182775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409799.307683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409799.432312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409799.552724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409799.680010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409799.819286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409799.953959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409800.067977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409800.185780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409800.313534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409800.438541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409800.563822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409800.690019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409800.812086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409800.939409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409801.051833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409801.185632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409801.330495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409801.437585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409801.558042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409801.687807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409801.811841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409801.935609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409802.059591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409802.180165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409802.308575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409802.453843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409802.566043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409802.679871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409802.807172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409802.940085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409803.062898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409803.189769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409803.314880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409803.444249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409803.571218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409803.695903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409803.821218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409803.950322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409804.086073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409804.226075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409804.351647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409804.494421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409804.613670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409804.758246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409804.865746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409805.008313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409805.112466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409805.267862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409805.371213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409805.502550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409805.628781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409805.755242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409805.879287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409805.998904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409806.128136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409806.268236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409806.389095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409806.514874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409806.644955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409806.779287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409806.892973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409807.033102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409807.157016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409807.305037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409807.421186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409807.550073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409807.676655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409807.807206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409807.932597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409808.056372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409808.184532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409808.307178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409808.431965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409808.577193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409808.685175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409808.815033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409808.940590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409809.064966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409809.181837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409809.313693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409809.434954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409809.561044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409809.684542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409809.806778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409809.941470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409810.076953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409810.192787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409810.310554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409810.438619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409810.564784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409810.692164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409810.828856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409810.941241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409811.073709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409811.218221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409811.326722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409811.459547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409811.602834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409811.756073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409811.887575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409812.028097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409812.155627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409812.265627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409812.396873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409812.539525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409812.663028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409812.789269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409812.932210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409813.051797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409813.181282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409813.315842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409813.445102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409813.570768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409813.695852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409813.818077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409813.945639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409814.076330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409814.216629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409814.331982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409814.468857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409814.604546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409814.723862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409814.856356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409814.975920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409815.109412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409815.233675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409815.362648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409815.494587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409815.615765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409815.749004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409815.875763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409815.994015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409816.116332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409816.242101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409816.372808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409816.497477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409816.620117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409816.752490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409816.871090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409816.994464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409817.122085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409817.247760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409817.365998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409817.497898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409817.637013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409817.747246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409817.875746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409818.000360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409818.128111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409818.249474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409818.373077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409818.498642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409818.630238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409818.752635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409818.880991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409819.005083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409819.130149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409819.252714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409819.378387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409819.518544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409819.632436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409819.766865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409819.911026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409820.036760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409820.170906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409820.300141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409820.422776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409820.545427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409820.674282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409820.799512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409820.927112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409821.055563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409821.175470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409821.306892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409821.428499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409821.560127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409821.687438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409821.808680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409821.927729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409822.058618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409822.187088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409822.310667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409822.439188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409822.562299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409822.699695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409822.815118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409822.941286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409823.070733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409823.193478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409823.318069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409823.444517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409823.579113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409823.692156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409823.820453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409823.952817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409824.097408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409824.203081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409824.356301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409824.467877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409824.605248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409824.735709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409824.850728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409824.987304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409825.113338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409825.232874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409825.351905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409825.489634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409825.617835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409825.746156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409825.868462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409825.997146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409826.127184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409826.247845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409826.366837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409826.491921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409826.638079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409826.754327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409826.874529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409827.005710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409827.124188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409827.246404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409827.376438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409827.499122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409827.642580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409827.755635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409827.882332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409828.018980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409828.147867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409828.272604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409828.409482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409828.541534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409828.682437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409828.807208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409828.933255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409829.063132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409829.186316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409829.309030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409829.437594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409829.562180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409829.686265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409829.811729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409829.939783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409830.060988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409830.203909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409830.311709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409830.431362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409830.564824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409830.693119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409830.818442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409830.993889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409831.101870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409831.223203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409831.353573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409831.482078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409831.607677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409831.736572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409831.867321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409831.991964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409832.115641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409832.240405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409832.369883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409832.513244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409832.638242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409832.750169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409832.890668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409833.003684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409833.127178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409833.253796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409833.375473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409833.497647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409833.628035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409833.749510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409833.871280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409834.005012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409834.118250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409834.243275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409834.371090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409834.515372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409834.626330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409834.754818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409834.876228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409835.005290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409835.129327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409835.262514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409835.383169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409835.512531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409835.654407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409835.757355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409835.883085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409836.017982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409836.154771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409836.291774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409836.422908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409836.553133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409836.679754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409836.806003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409836.933059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409837.064316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409837.184031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409837.332309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409837.443194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409837.574246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409837.706251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409837.828441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409837.970009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409838.124118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409838.254332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409838.365374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409838.483651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409838.613098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409838.758499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409838.867646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409838.993022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409839.121756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409839.237564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409839.374304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409839.501909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409839.642007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409839.782459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409839.898960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409840.030979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409840.171099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409840.301258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409840.430238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409840.552335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409840.689956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409840.804889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409840.937726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409841.062751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409841.180504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409841.308692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409841.451229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409841.557842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409841.698081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409841.828217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409841.977080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409842.097171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409842.246131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409842.357276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409842.485237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409842.618532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409842.738993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409842.870512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409842.994756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409843.121288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409843.248605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409843.380309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409843.497837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409843.625637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409843.753931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409843.895646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409844.027024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409844.160650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409844.301073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409844.432773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409844.560431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409844.686801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409844.802039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409844.938611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409845.067601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409845.192886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409845.307693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409845.432348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409845.566349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409845.688330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409845.833691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409845.955466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409846.079218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409846.193182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409846.328162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409846.456438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409846.595053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409846.719410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409846.862389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409846.991905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409847.116028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409847.240209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409847.367733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409847.495922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409847.623126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409847.759267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409847.891689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409848.018415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409848.162642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409848.279177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409848.419488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409848.556737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409848.700561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409848.815285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409848.949093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409849.081549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409849.196574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409849.327013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409849.462745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409849.591666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409849.722019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409849.846177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409849.986578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409850.113884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409850.232962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409850.368989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409850.482826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409850.621205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409850.745528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409850.860463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409850.997308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409851.122238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409851.248569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409851.373934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409851.500280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409851.638587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409851.744306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409851.862288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409851.999491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409852.121770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409852.253432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409852.376463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409852.505435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409852.636872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409852.759060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409852.905744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409853.038230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409853.177926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409853.304194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409853.430318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409853.548790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409853.699958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409853.812518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409853.954471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409854.069076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409854.194043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409854.324086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409854.453248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409854.574909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409854.702084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409854.831160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409854.954986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409855.108258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409855.224488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409855.350262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409855.482229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409855.618592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409855.745119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409855.891427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409856.019991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409856.163092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409856.289960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409856.413478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409856.537040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409856.675925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409856.791632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409856.927280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409857.058687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409857.186208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409857.321407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409857.436709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409857.557896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409857.686530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409857.807392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409857.939866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409858.061581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409858.202612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409858.311814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409858.443565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409858.563328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409858.702029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409858.815659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409858.939765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409859.075376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409859.198737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409859.332859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409859.453661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409859.585977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409859.735723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409859.858214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409860.007246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409860.119851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409860.272927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409860.379453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409860.506855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409860.623650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409860.752114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409860.886615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409861.003884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409861.129838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409861.288773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409861.414810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409861.548117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409861.668585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409861.801058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409861.923012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409862.045047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409862.177502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409862.303739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409862.424702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409862.556961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409862.679272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409862.809462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409862.926497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409863.053773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409863.175550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409863.304719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409863.429705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409863.557053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409863.677058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409863.803621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409863.930030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409864.062869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409864.183144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409864.309470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409864.427432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409864.555507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409864.689125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409864.805999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409864.932887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409865.058514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409865.183796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409865.299630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409865.443030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409865.552130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409865.671259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409865.801653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409865.926681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409866.057092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409866.181329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409866.309571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409866.434198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409866.561041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409866.688818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409866.813287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409866.939939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409867.063043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409867.190927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409867.317447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409867.458907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409867.573914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409867.700596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409867.849260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409867.977577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409868.102666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409868.239024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409868.352412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409868.480959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409868.611135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409868.737788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409868.879619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409868.996258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409869.117882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409869.242352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409869.372006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409869.494568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409869.619702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409869.745241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409869.882081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409870.000442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409870.141099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409870.253887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409870.378905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409870.512568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409870.646173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409870.770991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409870.907295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409871.044025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409871.180181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409871.305579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409871.421272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409871.547025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409871.685094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409871.823050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409871.940912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409872.074320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409872.193954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409872.331343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409872.442328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409872.573497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409872.701277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409872.821978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409872.960837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409873.076797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409873.228159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409873.336372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409873.485020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409873.605257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409873.739258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409873.866822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409873.993247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409874.120303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409874.251485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409874.388355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409874.489629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409874.620817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409874.763969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409874.877291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409875.013796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409875.126728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409875.253501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409875.380341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409875.516439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409875.659506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409875.768483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409875.910545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409876.042384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409876.169066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409876.298292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409876.413203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409876.550462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409876.676430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409876.796778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409876.916920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409877.054715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409877.184284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409877.306763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409877.423483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409877.557140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409877.695401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409877.817281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409877.930764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409878.082498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409878.185285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409878.314490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409878.434030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409878.559276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409878.682831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409878.813725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409878.940600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409879.067878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409879.191774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409879.327940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409879.453035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409879.594743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409879.725943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409879.860489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409879.979911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409880.116729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409880.236941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409880.368371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409880.496233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409880.623981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409880.750919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409880.875361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409880.997141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409881.122781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409881.263130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409881.375553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409881.491344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409881.617468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409881.746073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409881.875725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409881.998300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409882.126663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409882.254796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409882.381466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409882.504747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409882.635555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409882.765860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409882.889524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409883.012542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409883.161237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409883.290648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409883.422909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409883.548908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409883.683523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409883.810117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409883.933499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409884.051677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409884.186324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409884.324648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409884.442266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409884.577771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409884.693753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409884.831178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409884.974602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409885.100671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409885.226844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409885.354135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409885.479380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409885.613882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409885.742217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409885.887946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409885.994874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409886.120815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409886.247053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409886.369713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409886.496694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409886.622651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409886.753276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409886.867816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409886.993843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409887.124069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409887.244438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409887.361423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409887.498084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409887.621544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409887.746130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409887.867857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409888.001953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409888.262101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409888.514163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409888.844390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409889.050739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409889.256398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409889.498135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409889.686295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409889.866317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409890.038084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409890.200161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409890.407579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409890.566555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409890.740465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409890.927536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409891.066710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409891.309917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409891.459765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409891.579897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409891.764744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409891.930521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409892.123156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409892.287907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409892.443796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409892.616072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409892.815420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409893.011928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409893.208200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409893.345484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409893.459432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409893.607754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409893.740461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409893.868205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409893.987669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409894.116700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409894.237625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409894.371980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409894.496903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409894.622190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409894.751302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409894.870966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409895.011462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409895.140333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409895.263148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409895.388124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409895.512549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409895.655152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409895.767969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409895.890936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409896.058289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409896.284966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409896.414298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409896.537910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409896.675807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409896.802197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409896.924697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409897.065973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409897.193238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409897.324555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409897.457277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409897.615332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409897.727459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409897.866352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409897.992680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409898.123487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409898.243181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409898.371150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409898.491207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409898.617015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409898.746980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409898.868491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409898.993639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409899.115922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409899.242598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409899.373962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409899.491407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409899.615664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409899.748194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409899.876538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409900.003320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409900.126729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409900.250757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409900.385415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409900.508728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409900.638849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409900.765570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409900.900564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409901.028749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409901.172047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409901.317815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409901.442405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409901.582364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409901.747368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409901.864185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409901.996828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409902.127924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409902.248451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409902.368012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409902.493256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409902.623753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409902.775688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409902.886399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409903.011595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409903.134893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409903.274904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409903.400563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409903.536965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409903.676082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409903.813499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409903.949017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409904.087645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409904.211716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409904.345602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409904.477794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409904.600524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409904.724782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409904.855774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409904.973341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409905.106529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409905.231102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409905.362591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409905.482869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409905.616645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409905.748901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409905.871212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409905.997160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409906.120877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409906.250041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409906.379207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409906.502424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409906.633700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409906.762404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409906.905910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409907.041299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409907.163996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409907.300497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409907.445873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409907.573157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409907.689565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409907.819137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409907.939936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409908.078562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409908.219714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409908.339576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409908.474026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409908.608222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409908.735288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409908.865934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409908.998020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409909.117505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409909.251169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409909.365418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409909.499635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409909.620417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409909.747279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409909.873228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409910.010091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409910.119385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409910.242117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409910.374499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409910.500329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409910.614794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409910.734465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409910.871775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409910.996292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409911.119147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409911.246706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409911.369000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409911.508057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409911.627394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409911.768320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409911.886990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409912.002556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409912.140523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409912.264693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409912.393956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409912.525769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409912.662640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409912.807665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409912.924628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409913.047263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409913.176606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409913.307755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409913.420428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409913.551990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409913.678035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409913.807915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409913.932340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409914.068925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409914.177146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409914.317280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409914.449785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409914.578197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409914.685851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409914.811936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409914.933864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409915.073184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409915.192845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409915.338448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409915.458982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409915.595392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409915.737850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409915.876391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409915.995853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409916.122465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409916.242741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409916.369829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409916.498529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409916.633589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409916.765863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409916.892242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409917.011026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409917.130606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409917.261252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409917.386644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409917.512173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409917.648124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409917.784881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409917.923727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409918.045942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409918.175888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409918.309784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409918.435361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409918.557167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409918.684378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409918.807546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409918.936507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409919.062176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409919.204574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409919.316999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409919.446695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409919.578987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409919.691978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409919.822855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409919.948282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409920.091002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409920.240672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409920.359020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409920.487387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409920.614181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409920.737432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409920.862270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409920.993059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409921.123629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409921.257723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409921.378487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409921.533503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409921.633193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409921.762351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409921.908468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409922.016350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409922.156569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409922.287071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409922.412696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409922.548911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409922.685086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409922.818282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409922.938049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409923.062503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409923.179402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409923.307110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409923.430368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409923.559589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409923.681300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409923.813624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409923.940401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409924.062880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409924.190463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409924.333288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409924.454141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409924.583046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409924.720202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409924.855014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409924.986263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409925.111731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409925.240003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409925.375223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409925.509169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409925.619028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409925.742826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409925.871247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409925.990763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409926.140846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409926.245778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409926.374833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409926.500359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409926.622837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409926.744309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409926.878559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409927.003072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409927.136383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409927.253517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409927.376271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409927.505918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409927.653096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409927.782981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409927.909557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409928.045931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409928.179624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409928.305169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409928.431757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409928.550900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409928.682071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409928.802814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409928.934090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409929.058436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409929.200433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409929.301276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409929.435453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409929.559935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409929.687821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409929.819105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409929.951545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409930.084226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409930.239137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409930.366365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409930.493499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409930.616385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409930.742317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409930.866994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409931.001468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409931.127699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409931.246309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409931.370917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409931.499352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409931.620351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409931.755873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409931.885558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409932.013588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409932.141735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409932.285442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409932.425737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409932.564411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409932.683755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409932.811371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409932.935686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409933.058361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409933.183304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409933.310653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409933.446038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409933.551111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409933.683564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409933.811170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409933.937749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409934.070344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409934.222322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409934.345894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409934.477818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409934.600629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409934.729059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409934.864263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409934.988456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409935.109472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409935.241541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409935.373265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409935.492626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409935.622136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409935.751614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409935.882808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409935.997052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409936.121778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409936.248852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409936.391297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409936.510370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409936.632833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409936.762115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409936.907511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409937.034942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409937.161361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409937.295621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409937.420763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409937.545730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409937.666986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409937.797846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409937.923271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409938.042657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409938.171289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409938.295338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409938.420617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409938.552698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409938.679802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409938.801634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409938.932286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409939.058025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409939.180217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409939.302590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409939.432665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409939.554227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409939.680847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409939.805766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409939.932556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409940.054243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409940.177540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409940.309629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409940.433347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409940.552297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409940.681313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409940.827637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409940.931883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409941.051846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409941.184082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409941.308789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409941.452070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409941.554734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409941.680936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409941.807651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409941.931429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409942.055715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409942.180598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409942.294979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409942.439228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409942.566831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409942.689941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409942.830362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409942.948632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409943.069702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409943.208107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409943.330195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409943.476024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409943.600047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409943.737415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409943.861677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409943.994342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409944.120844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409944.241412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409944.369989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409944.497099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409944.620983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409944.746005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409944.871490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409945.008811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409945.118421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409945.232822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409945.385561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409945.508088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409945.622219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409945.749537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409945.875525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409946.014775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409946.142108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409946.260880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409946.390989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409946.517657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409946.654253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409946.799169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409946.926377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409947.049303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409947.178092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409947.312670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409947.428673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409947.553169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409947.690894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409947.800528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409947.929332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409948.059588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409948.187654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409948.322413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409948.433632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409948.560855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409948.743063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409948.928795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409949.036508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409949.176653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409949.294197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409949.431013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409949.553879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409949.681263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409949.806910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409949.934581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409950.056261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409950.183792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409950.327237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409950.437797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409950.570951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409950.701767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409950.827457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409950.965715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409951.105072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409951.237088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409951.361094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409951.498507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409951.635187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409951.745648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409951.872906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409952.000611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409952.131336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409952.262888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409952.381647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409952.513457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409952.661669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409952.786670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409952.929430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409953.054680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409953.184909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409953.312703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409953.428472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409953.561300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409953.685373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409953.815993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409953.937241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409954.073427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409954.203483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409954.340069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409954.492814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409954.600737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409954.727731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409954.859336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409954.993111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409955.109741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409955.239166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409955.367726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409955.492221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409955.619106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409955.734172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409955.863656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409955.994375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409956.117734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409956.238209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409956.363254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409956.481969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409956.616247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409956.750850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409956.870249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409956.995465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409957.119059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409957.250878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409957.375205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409957.511319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409957.639020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409957.773220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409957.909602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409958.039224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409958.183416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409958.298886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409958.429002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409958.556070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409958.683517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409958.811540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409958.947739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409959.078549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409959.205675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409959.341655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409959.482337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409959.603031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409959.740923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409959.866271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409959.991105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409960.118517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409960.247102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409960.367738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409960.512637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409960.614861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409960.747652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409960.875525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409960.993535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409961.109094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409961.262760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409961.377672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409961.518924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409961.639142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409961.791655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409961.925900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409962.058613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409962.183900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409962.308593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409962.450436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409962.562270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409962.683852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409962.809519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409962.934303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409963.072735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409963.191363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409963.324357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409963.448878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409963.581018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409963.715096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409963.855608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409963.975323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409964.112937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409964.228832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409964.367883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409964.493081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409964.625910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409964.752070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409964.878579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409965.010650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409965.136066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409965.264328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409965.411361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409965.540885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409965.663361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409965.804905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409965.933089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409966.052483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409966.182603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409966.316690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409966.435504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409966.557916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409966.698529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409966.811383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409966.923630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409967.056174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409967.195758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409967.308273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409967.425676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409967.558125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409967.691994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409967.818806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409967.952850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409968.112645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409968.205972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409968.336533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409968.473502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409968.610206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409968.742693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409968.868725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409968.989490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409969.120152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409969.241617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409969.367048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409969.496205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409969.616119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409969.776340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409969.895374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409970.051717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409970.170061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409970.298138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409970.420284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409970.547849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409970.673753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409970.799804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409970.927478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409971.052536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409971.183178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409971.307667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409971.426679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409971.550100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409971.681760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409971.826411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409971.929951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409972.059816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409972.185348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409972.313882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409972.437633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409972.587707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409972.715474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409972.828691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409972.961518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409973.092137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409973.237744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409973.354497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409973.472728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409973.614136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409973.737784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409973.869118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409973.996399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409974.119022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409974.242139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409974.386170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409974.516511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409974.645282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409974.776224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409974.914128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409975.049227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409975.189095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409975.304338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409975.439557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409975.550668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409975.682895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409975.816931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409975.962510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409976.097538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409976.237074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409976.358611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409976.495999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409976.621917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409976.753693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409976.873647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409976.998260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409977.126749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409977.258473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409977.380957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409977.513360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409977.652016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409977.784882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409977.924807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409978.047027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409978.169706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409978.296627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409978.412889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409978.541721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409978.663915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409978.800449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409978.921834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409979.050711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409979.177740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409979.303839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409979.430970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409979.558710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409979.684483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409979.823332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409979.947745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409980.091269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409980.212910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409980.345694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409980.481350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409980.615802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409980.738714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409980.874030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409980.994818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409981.119131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409981.248490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409981.372316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409981.500801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409981.617556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409981.742036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409981.872000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409981.997318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409982.125488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409982.249642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409982.392263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409982.524006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409982.649545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409982.776552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409982.917875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409983.038568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409983.177795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409983.297186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409983.443032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409983.545509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409983.671269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409983.806497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409983.925556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409984.053418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409984.174522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409984.301913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409984.431215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409984.564807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409984.679646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409984.803191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409984.927429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409985.051311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409985.173921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409985.294594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409985.424930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409985.552707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409985.677628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409985.816317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409985.946114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409986.050927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409986.254283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409986.490345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409986.633491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409986.753566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409986.870058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409986.995795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409987.116876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409987.247278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409987.373725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409987.499623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409987.623681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409987.755668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409987.881528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409988.016906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409988.154289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409988.283593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409988.416335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409988.548681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409988.665949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409988.796868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409988.924030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409989.052595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409989.175477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409989.315662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409989.426599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409989.552227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409989.676924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409989.802084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409989.939157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409990.056257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409990.183747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409990.344008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409990.454280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409990.593278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409990.719769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409990.855994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409990.972641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409991.118388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409991.236730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409991.370251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409991.487273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409991.614124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409991.742292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409991.882419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409992.006737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409992.134458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409992.274120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409992.411517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409992.542201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409992.672112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409992.792276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409992.913447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409993.044412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409993.178962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409993.294515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409993.431825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409993.550936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409993.673985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409993.804440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409993.946007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409994.053536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409994.187660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409994.306065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409994.451548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409994.565171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409994.694904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409994.824392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409994.965311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409995.092342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409995.221500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409995.362193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409995.493532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409995.615981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409995.742351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409995.865200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409995.998084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409996.120960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409996.252108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409996.383675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409996.516018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409996.653986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409996.783415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409996.911310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409997.047124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409997.169667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409997.299597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409997.416724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409997.547623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409997.667864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409997.804043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409997.918945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409998.051515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409998.179332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409998.318854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409998.434793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409998.579056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409998.690502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409998.818916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409998.946204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638409999.088491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409999.204013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409999.339968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409999.469811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409999.592357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409999.727418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409999.848437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638409999.985716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410000.133719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410000.241060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410000.375165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410000.498757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410000.625226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410000.757219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410000.902189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410001.033911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410001.176022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410001.307096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410001.432359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410001.550059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410001.679411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410001.802068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410001.928864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410002.056207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410002.180132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410002.313555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410002.432391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410002.553335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410002.680581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410002.800861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410002.927454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410003.054345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410003.178224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410003.302524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410003.420717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410003.548769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410003.694802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410003.802219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410003.930811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410004.061787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410004.194234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410004.328583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410004.484958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410004.603707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410004.732878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410004.854380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410004.987180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410005.108366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410005.233128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410005.358436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410005.482809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410005.623616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410005.733865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410005.861270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410005.987986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410006.112008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410006.235502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410006.361296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410006.488596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410006.617738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410006.749796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410006.875594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410007.000928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410007.124309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410007.257430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410007.401053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410007.520787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410007.653728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410007.783628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410007.923710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410008.042249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410008.168014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410008.299738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410008.416172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410008.550866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410008.677336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410008.815344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410009.154983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410009.445020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410009.630647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410009.814025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410009.981371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410010.153933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410010.318211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410010.502962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410010.679921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410010.868815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410011.026865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410011.195987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410011.415515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410011.554902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410011.761448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410011.953850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410012.081618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410012.223140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410012.410778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410012.553773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410012.740759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410012.920568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410013.124987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410013.274082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410013.433002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410013.660848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410013.850164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410013.987961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410014.112046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410014.247569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410014.366893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410014.496190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410014.616750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410014.745152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410014.870381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410015.009444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410015.120098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410015.246682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410015.360496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410015.483089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410015.612938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410015.739956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410015.852894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410015.985365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410016.104109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410016.231762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410016.358716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410016.484270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410016.618297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410016.821934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410016.989808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410017.117343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410017.235639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410017.366414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410017.481681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410017.612919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410017.736506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410017.866465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410018.004517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410018.121907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410018.240965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410018.364712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410018.492575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410018.616028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410018.744361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410018.881190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410019.006126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410019.117232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410019.244835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410019.382716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410019.491638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410019.621225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410019.747968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410019.875396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410020.007782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410020.132621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410020.259861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410020.404164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410020.518834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410020.652315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410020.782155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410020.905456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410021.042429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410021.174037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410021.318695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410021.425412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410021.550826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410021.672891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410021.825230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410021.968202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410022.101306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410022.231461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410022.354155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410022.480099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410022.610184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410022.729645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410022.854888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410022.981202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410023.108838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410023.248719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410023.358848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410023.493561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410023.611390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410023.762279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410023.881212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410024.016515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410024.143294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410024.292952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410024.406892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410024.544014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410024.679622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410024.802533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410024.923620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410025.066999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410025.168240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410025.295625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410025.428936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410025.560472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410025.680955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410025.810885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410025.937628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410026.057493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410026.186331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410026.338482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410026.451564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410026.580108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410026.711706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410026.846132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410026.988110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410027.108463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410027.241922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410027.364310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410027.504075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410027.615080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410027.745795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410027.882791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410028.005935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410028.146258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410028.271230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410028.409563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410028.534416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410028.668277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410028.795832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410028.921886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410029.058909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410029.193912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410029.305730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410029.428023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410029.569649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410029.684876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410029.816581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410029.942455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410030.073227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410030.205808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410030.325304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410030.456651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410030.593150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410030.739932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410030.852625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410030.987256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410031.103003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410031.230253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410031.363160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410031.491970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410031.617849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410031.743973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410031.870092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410032.001930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410032.138186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410032.264063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410032.384182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410032.530214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410032.653278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410032.799844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410032.917982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410033.045200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410033.172416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410033.289508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410033.414612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410033.546869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410033.675674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410033.805249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410033.947707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410034.061211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410034.202748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410034.312663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410034.446986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410034.580935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410034.715019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410034.854224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410034.983744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410035.110524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410035.235019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410035.368016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410035.491647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410035.616124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410035.770333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410035.880430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410036.014289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410036.143420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410036.280616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410036.407115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410036.540256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410036.669770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410036.802100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410036.921731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410037.041613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410037.171410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410037.303715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410037.422541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410037.550608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410037.675786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410037.803854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410037.930810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410038.058964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410038.187586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410038.325995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410038.447092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410038.591056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410038.697629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410038.853349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410038.980732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410039.113507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410039.236391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410039.359464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410039.482421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410039.606386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410039.738084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410039.856385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410039.990705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410040.115000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410040.240475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410040.374750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410040.488003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410040.612117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410040.745492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410040.871020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410040.991608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410041.123745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410041.247203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410041.372865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410041.495471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410041.636724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410041.752141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410041.880766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410042.005687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410042.137104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410042.274672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410042.410229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410042.539459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410042.667205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410042.799351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410042.913329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410043.045876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410043.167371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410043.298283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410043.425696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410043.551706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410043.673982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410043.820199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410043.932470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410044.064009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410044.185999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410044.313657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410044.444895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410044.571631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410044.701605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410044.843479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410044.962971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410045.100665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410045.221572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410045.353006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410045.471437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410045.623519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410045.726205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410045.888900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410046.016762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410046.142356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410046.286128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410046.419746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410046.552359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410046.667896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410046.793614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410046.925090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410047.045312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410047.178180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410047.306961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410047.417808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410047.546509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410047.679703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410047.803005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410047.928855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410048.057963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410048.181990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410048.323032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410048.429739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410048.557108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410048.681224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410048.805870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410048.928632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410049.061740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410049.188498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410049.319877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410049.444165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410049.578260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410049.714279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410049.845561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410049.972423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410050.109908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410050.234742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410050.358193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410050.485504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410050.606239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410050.737608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410050.857085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410050.987917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410051.121198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410051.240126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410051.381343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410051.490340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410051.635430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410051.765574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410051.903383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410052.030070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410052.165754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410052.296139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410052.424146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410052.545947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410052.674142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410052.806472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410052.939150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410053.052620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410053.174154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410053.303283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410053.431560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410053.561060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410053.685763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410053.819572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410053.960080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410054.091568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410054.225486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410054.354828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410054.477568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410054.613683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410054.736847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410054.866320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410054.989100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410055.129880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410055.253874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410055.365459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410055.487662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410055.619194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410055.741517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410055.857827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410055.986826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410056.110028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410056.234119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410056.357430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410056.492138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410056.616869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410056.739801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410056.864346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410056.983590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410057.108003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410057.237456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410057.375158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410057.491185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410057.627708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410057.743692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410057.874645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410058.009235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410058.132638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410058.258622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410058.390914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410058.531460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410058.662014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410058.789419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410058.915753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410059.037895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410059.165696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410059.304214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410059.446970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410059.558489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410059.684088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410059.810469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410059.935062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410060.057951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410060.185980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410060.311317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410060.444095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410060.578771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410060.700815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410060.834077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410060.968931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410061.097985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410061.232549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410061.365289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410061.492859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410061.614735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410061.741991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410061.869242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410062.006592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410062.115270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410062.239438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410062.368678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410062.496299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410062.619947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410062.757967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410062.872908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410063.008387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410063.134536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410063.256820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410063.395034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410063.530518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410063.654672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410063.794967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410063.926766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410064.055334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410064.180982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410064.301672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410064.424713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410064.561531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410064.676172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410064.805064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410064.923427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410065.048749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410065.176480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410065.303305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410065.426048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410065.551869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410065.710752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410065.828812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410065.969813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410066.098222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410066.232061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410066.359568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410066.474108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410066.610397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410066.728183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410066.857302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410066.986622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410067.122498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410067.246686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410067.355591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410067.488106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410067.619672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410067.743918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410067.867670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410067.989513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410068.120858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410068.238286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410068.373307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410068.489285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410068.617300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410068.735908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410068.870181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410069.001185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410069.123424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410069.256879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410069.390317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410069.512628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410069.655069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410069.797432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410069.909889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410070.042777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410070.171400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410070.290658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410070.418074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410070.541162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410070.671916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410070.792274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410070.922545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410071.054962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410071.175720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410071.305709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410071.421876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410071.547678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410071.674437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410071.805532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410071.947059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410072.061359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410072.196101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410072.317249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410072.460891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410072.602958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410072.737367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410072.866003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410072.981077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410073.109792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410073.235847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410073.365901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410073.488008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410073.611770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410073.735101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410073.863508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410074.006602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410074.110948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410074.256168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410074.361106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410074.499649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410074.610824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410074.744554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410074.865211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410074.993700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410075.115633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410075.240576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410075.365077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410075.493335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410075.613515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410075.738822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410075.875504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410075.989931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410076.107756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410076.237293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410076.361450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410076.491147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410076.619066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410076.744615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410076.869852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410076.996024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410077.120454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410077.258873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410077.380203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410077.509268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410077.635098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410077.795907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410077.919734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410078.044070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410078.173600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410078.301280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410078.441110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410078.550533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410078.679750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410078.809012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410078.938984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410079.059117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410079.194430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410079.316717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410079.442872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410079.571600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410079.716456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410079.853025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410079.986014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410080.112278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410080.231550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410080.357291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410080.479389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410080.611120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410080.736870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410080.879873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410080.991348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410081.135953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410081.256189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410081.372903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410081.492644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410081.620647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410081.775956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410081.910216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410082.036327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410082.162074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410082.293149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410082.418236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410082.538496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410082.669855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410082.796758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410082.915645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410083.042825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410083.167538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410083.297962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410083.423595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410083.565118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410083.673826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410083.800340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410083.933491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410084.067874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410084.183013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410084.307506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410084.428053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410084.562096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410084.674336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410084.806059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410084.933906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410085.057828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410085.187532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410085.313167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410085.445169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410085.561033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410085.694286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410085.827444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410085.965981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410086.095647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410086.212333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410086.351505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410086.471159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410086.602883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410086.730443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410086.859089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410086.984154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410087.115548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410087.237144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410087.360393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410087.500319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410087.606368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410087.752632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410087.854509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410087.994194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410088.114067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410088.245744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410088.368568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410088.496453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410088.621675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410088.757810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410088.884473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410089.014193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410089.169940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410089.295609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410089.401914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410089.546616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410089.673628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410089.801896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410089.924397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410090.057197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410090.179949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410090.316697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410090.439479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410090.566941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410090.709802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410090.847503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410090.973228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410091.098929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410091.219820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410091.347414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410091.479060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410091.598351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410091.726678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410091.853089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410091.975580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410092.102405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410092.255467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410092.360118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410092.491916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410092.602226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410092.741683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410092.873287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410092.993207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410093.120036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410093.244169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410093.371982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410093.496978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410093.621279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410093.756012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410093.886231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410094.020616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410094.160818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410094.287056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410094.405370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410094.552272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410094.676071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410094.794695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410094.921108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410095.062258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410095.177546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410095.300354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410095.423423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410095.551506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410095.677704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410095.803979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410095.933733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410096.056971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410096.184866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410096.318674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410096.445240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410096.595267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410096.708988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410096.841216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410096.964859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410097.090557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410097.223084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410097.345605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410097.481293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410097.608969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410097.725746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410097.853021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410097.984684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410098.129419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410098.253279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410098.372091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410098.497235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410098.623095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410098.747706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410098.883264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410099.004316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410099.154263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410099.275016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410099.404902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410099.528534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410099.652868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410099.783464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410099.911693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410100.052828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410100.172481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410100.302444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410100.439118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410100.559166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410100.676720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410100.815254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410100.931601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410101.063261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410101.196907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410101.303378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410101.427631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410101.567355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410101.681633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410101.808080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410101.946002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410102.093206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410102.220508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410102.343292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410102.473909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410102.616993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410102.728918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410102.863216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410102.987236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410103.114593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410103.254374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410103.365816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410103.487968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410103.616057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410103.737111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410103.862109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410103.986168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410104.112349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410104.231771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410104.361964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410104.494186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410104.618791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410104.745477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410104.869051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410105.001101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410105.135553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410105.253706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410105.379474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410105.514559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410105.663350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410105.778450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410105.908320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410106.035320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410106.166754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410106.290296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410106.427163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410106.559764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410106.682313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410106.802084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410106.931150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410107.054414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410107.184201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410107.308944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410107.449767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410107.568068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410107.698451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410107.837483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410107.965729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410108.103226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410108.235571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410108.361895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410108.486625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410108.615612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410108.737453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410108.861645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410108.986967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410109.126649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410109.240963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410109.358763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410109.505963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410109.611323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410109.729326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410109.863621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410110.009645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410110.117860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410110.245235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410110.374465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410110.491140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410110.615423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410110.760083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410110.878053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410111.004822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410111.138041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410111.276182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410111.408495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410111.543007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410111.679035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410111.817466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410111.933842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410112.077833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410112.193042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410112.327899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410112.441803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410112.584627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410112.711579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410112.858194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410112.981853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410113.110343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410113.228883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410113.360426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410113.502264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410113.612703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410113.732575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410113.881832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410113.988386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410114.132972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410114.240891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410114.374088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410114.503454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410114.626381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410114.744947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410114.877370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410115.007401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410115.150849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410115.278308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410115.434407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410115.542664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410115.667011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410115.795101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410115.918265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410116.039935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410116.179834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410116.296312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410116.425017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410116.546028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410116.678126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410116.786110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410116.926240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410117.048485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410117.173345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410117.307750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410117.431290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410117.553824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410117.688365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410117.818109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410117.948249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410118.089584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410118.223721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410118.350083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410118.482683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410118.606254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410118.737640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410118.863175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410119.007331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410119.113017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410119.245927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410119.363790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410119.496362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410119.612389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410119.742723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410119.862850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410119.993951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410120.122448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410120.247605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410120.376080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410120.497081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410120.631732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410120.774573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410120.901926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410121.044856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410121.164384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410121.297063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410121.415282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410121.548650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410121.676411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410121.800188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410121.942650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410122.052416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410122.178302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410122.314426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410122.434838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410122.567687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410122.692508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410122.837617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410122.962968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410123.088658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410123.217288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410123.346445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410123.469029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410123.594878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410123.718490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410123.858568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410123.981838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410124.103518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410124.237217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410124.379202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410124.482815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410124.603968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410124.733118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410124.861004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410124.985285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410125.113365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410125.243384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410125.368857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410125.501631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410125.627650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410125.768856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410125.903559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410126.041550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410126.175830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410126.292122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410126.421493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410126.539881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410126.678528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410126.795667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410126.923262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410127.045628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410127.175092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410127.300762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410127.424562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410127.554139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410127.676911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410127.801805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410127.927602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410128.056547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410128.177188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410128.304901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410128.435321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410128.555901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410128.685300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410128.818211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410128.951158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410129.086190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410129.258181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410129.533923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410129.813335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410130.052857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410130.277653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410130.440607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410130.590230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410130.754660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410130.976935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410131.113537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410131.290718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410131.446039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410131.671384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410131.865546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410132.043892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410132.194280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410132.402553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410132.605048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410132.734655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410132.879664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410133.086271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410133.219028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410133.380811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410133.561196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410133.741574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410133.949153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410134.098829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410134.257988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410134.513826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410134.629371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410134.756391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410134.888999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410135.012307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410135.167106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410135.277826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410135.415352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410135.548755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410135.673823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410135.805053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410135.919678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410136.054697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410136.176831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410136.305423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410136.431621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410136.555286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410136.679986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410136.807816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410136.929818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410137.058326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410137.185173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410137.334955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410137.552498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410137.723628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410137.867188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410137.992072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410138.126107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410138.250937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410138.380833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410138.522382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410138.656508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410138.770656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410138.901445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410139.025753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410139.167840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410139.281592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410139.416387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410139.535906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410139.671269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410139.795675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410139.927339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410140.047510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410140.173669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410140.299605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410140.423251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410140.554021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410140.711871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410140.814670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410140.951140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410141.087351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410141.227093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410141.343714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410141.471270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410141.608954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410141.757120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410141.876506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410142.012294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410142.127787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410142.270855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410142.387967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410142.531081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410142.674080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410142.802550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410142.937548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410143.051195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410143.191499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410143.306477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410143.429220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410143.557018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410143.682584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410143.817122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410143.952112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410144.086065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410144.213649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410144.355043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410144.487781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410144.616816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410144.737783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410144.868600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410145.003231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410145.125925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410145.248509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410145.387161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410145.517039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410145.649118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410145.781569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410145.920809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410146.044385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410146.179891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410146.296079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410146.426175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410146.549474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410146.673290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410146.817930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410146.921731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410147.049974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410147.171024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410147.302023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410147.423173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410147.542972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410147.676507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410147.800596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410147.929974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410148.052840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410148.189292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410148.315086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410148.441418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410148.580215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410148.719005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410148.837831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410148.983396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410149.111787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410149.234747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410149.375439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410149.489507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410149.606957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410149.735473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410149.863523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410150.003772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410150.126859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410150.242798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410150.358942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410150.475952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410150.614179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410150.734956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410150.860001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410150.988811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410151.112697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410151.246111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410151.368241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410151.500727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410151.635523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410151.774559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410151.897228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410152.046041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410152.169926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410152.314587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410152.422283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410152.554844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410152.678370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410152.817374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410152.945260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410153.084501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410153.213489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410153.347640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410153.473063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410153.598686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410153.726715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410153.863361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410153.983815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410154.114488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410154.239396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410154.366124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410154.503460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410154.618066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410154.750794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410154.885605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410155.011341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410155.142074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410155.281191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410155.420442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410155.532670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410155.663080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410155.815979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410155.933239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410156.071557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410156.207795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410156.309671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410156.431995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410156.566074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410156.699870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410156.836780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410156.978439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410157.095970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410157.228956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410157.356830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410157.481510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410157.602388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410157.741501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410157.876422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410157.985159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410158.108614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410158.240828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410158.352930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410158.479842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410158.617009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410158.758247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410158.874625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410159.003153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410159.136170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410159.283808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410159.398671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410159.532628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410159.662330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410159.790920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410159.924974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410160.051704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410160.174443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410160.316096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410160.422321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410160.551890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410160.677511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410160.799011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410160.922503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410161.052023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410161.179198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410161.309038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410161.451093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410161.564273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410161.690768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410161.819002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410161.950215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410162.091606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410162.215291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410162.352664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410162.465886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410162.606880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410162.723409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410162.852773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410162.990317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410163.116010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410163.233827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410163.365049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410163.487114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410163.616460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410163.740326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410163.860666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410163.989474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410164.110017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410164.238712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410164.361970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410164.493739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410164.628311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410164.735576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410164.867025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410164.982564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410165.109179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410165.233148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410165.372945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410165.497763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410165.620085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410165.741752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410165.872348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410166.008416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410166.129992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410166.266650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410166.401185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410166.525887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410166.665197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410166.789687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410166.920350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410167.043891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410167.172335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410167.294357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410167.424440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410167.555485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410167.675033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410167.800488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410167.931703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410168.056816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410168.205173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410168.324613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410168.460139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410168.597513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410168.724229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410168.852640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410168.976158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410169.127329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410169.232858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410169.362217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410169.492244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410169.616075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410169.752394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410169.868552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410170.002060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410170.133929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410170.247768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410170.395145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410170.512115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410170.631305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410170.775489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410170.926239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410171.047060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410171.177771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410171.315486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410171.438180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410171.567275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410171.722880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410171.840144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410171.979000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410172.102605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410172.226097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410172.350931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410172.481267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410172.606559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410172.735331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410172.868833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410172.986519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410173.110605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410173.233202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410173.354021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410173.479629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410173.607641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410173.731075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410173.863894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410173.989022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410174.116874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410174.248987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410174.362129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410174.484503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410174.611927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410174.734282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410174.879245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410174.994995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410175.125220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410175.242082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410175.367152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410175.490929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410175.618371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410175.766818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410175.873197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410176.000494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410176.133798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410176.255658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410176.399887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410176.512849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410176.655328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410176.777926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410176.920151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410177.033302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410177.156954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410177.290543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410177.419587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410177.554625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410177.669347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410177.794995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410177.925946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410178.050641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410178.176761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410178.319717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410178.446255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410178.572797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410178.689267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410178.818000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410178.948849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410179.085304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410179.220632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410179.351770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410179.482133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410179.597521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410179.732302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410179.858165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410179.988509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410180.111185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410180.240099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410180.364196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410180.495957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410180.618003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410180.754994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410180.870166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410181.006587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410181.131981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410181.271662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410181.399888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410181.527077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410181.653467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410181.791222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410181.913807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410182.048315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410182.170562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410182.302596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410182.422813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410182.550611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410182.672429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410182.798127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410182.949791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410183.080395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410183.205515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410183.344803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410183.469579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410183.589077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410183.720039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410183.855601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410183.978241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410184.102160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410184.222515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410184.370300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410184.484797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410184.613782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410184.735435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410184.861670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410184.982061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410185.128940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410185.237551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410185.360155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410185.483180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410185.616361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410185.736487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410185.866154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410186.003236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410186.120519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410186.237299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410186.356354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410186.483828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410186.611284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410186.735296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410186.865431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410187.003665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410187.130867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410187.253881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410187.399009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410187.524123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410187.655823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410187.774514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410187.901924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410188.038316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410188.155914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410188.286166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410188.438369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410188.543800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410188.663010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410188.794331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410188.920723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410189.050013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410189.178025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410189.301503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410189.447466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410189.555466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410189.708385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410189.819599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410189.948943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410190.086061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410190.214113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410190.341670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410190.479767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410190.600967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410190.740877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410190.854412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410190.977051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410191.104152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410191.231482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410191.355603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410191.487020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410191.609665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410191.742582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410191.863128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410191.985260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410192.107015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410192.235875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410192.357884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410192.481938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410192.606893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410192.732853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410192.856164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410192.986972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410193.113333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410193.242618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410193.378851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410193.493154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410193.618953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410193.770039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410193.878074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410194.021878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410194.155891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410194.292562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410194.419806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410194.557202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410194.661730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410194.797652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410194.910257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410195.046409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410195.171768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410195.296671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410195.428694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410195.548437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410195.667762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410195.796916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410195.925862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410196.079096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410196.183000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410196.317997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410196.445607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410196.574319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410196.711051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410196.828674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410196.966519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410197.104391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410197.235785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410197.353715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410197.477746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410197.600768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410197.729721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410197.875332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410197.981986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410198.115831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410198.251922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410198.365968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410198.499826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410198.635556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410198.753435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410198.883327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410199.023422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410199.170707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410199.298104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410199.417112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410199.544598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410199.672030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410199.807359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410199.939419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410200.066130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410200.201522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410200.349792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410200.479053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410200.600727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410200.732073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410200.865414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410200.998909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410201.120308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410201.255024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410201.369813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410201.505553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410201.644426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410201.815510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410201.928801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410202.051018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410202.174738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410202.303709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410202.422629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410202.569326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410202.677844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410202.815625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410202.943357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410203.077656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410203.211451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410203.344027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410203.478187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410203.610604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410203.737698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410203.862793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410203.988778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410204.125541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410204.240960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410204.375285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410204.507931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410204.631105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410204.761232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410204.887316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410205.022898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410205.162590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410205.288885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410205.412343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410205.538365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410205.669568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410205.795546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410205.923251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410206.038765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410206.169347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410206.294891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410206.422087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410206.547877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410206.674995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410206.797522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410206.924071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410207.055493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410207.173038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410207.300272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410207.426489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410207.550172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410207.672374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410207.805852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410207.939043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410208.070833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410208.203766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410208.333091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410208.462575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410208.590692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410208.727806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410208.854669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410208.978916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410209.104381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410209.249721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410209.359998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410209.500889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410209.609843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410209.755199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410209.864436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410209.997987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410210.125684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410210.258466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410210.391277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410210.525006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410210.662593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410210.790507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410210.921307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410211.050304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410211.175197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410211.310472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410211.430843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410211.561017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410211.689287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410211.833114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410211.945042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410212.081739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410212.209304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410212.353100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410212.478050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410212.610515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410212.731223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410212.863018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410212.987443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410213.120175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410213.244713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410213.374293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410213.501705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410213.620534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410213.744688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410213.901083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410214.013804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410214.160138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410214.284583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410214.406023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410214.526668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410214.656229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410214.793068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410214.914749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410215.034035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410215.168167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410215.284256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410215.418219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410215.545958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410215.694249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410215.815088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410215.937526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410216.063829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410216.200034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410216.324382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410216.462720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410216.591532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410216.724858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410216.850468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410216.987100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410217.095069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410217.216973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410217.370757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410217.493373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410217.614202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410217.737557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410217.857409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410217.981112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410218.103352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410218.251248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410218.353887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410218.503413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410218.605490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410218.724473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410218.866369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410218.977614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410219.108646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410219.231989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410219.357922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410219.485933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410219.593920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410219.724872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410219.848451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410219.979161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410220.101685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410220.225140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410220.355556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410220.480585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410220.608781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410220.735970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410220.847101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410220.981782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410221.109203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410221.235284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410221.357500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410221.484693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410221.608176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410221.732803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410221.861172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410222.000487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410222.116009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410222.241191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410222.369331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410222.520434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410222.646402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410222.770861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410222.920786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410223.049612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410223.181369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410223.296426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410223.421548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410223.550465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410223.667352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410223.797334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410223.920951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410224.049848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410224.172382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410224.299692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410224.440538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410224.553992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410224.702039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410224.810978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410224.943934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410225.084100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410225.209211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410225.349142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410225.469743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410225.595392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410225.729856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410225.856634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410225.981938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410226.111051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410226.234407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410226.361348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410226.482302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410226.616752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410226.733748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410226.862604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410226.987817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410227.119231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410227.247556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410227.379237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410227.492208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410227.627743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410227.756911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410227.898080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410228.022264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410228.168601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410228.287475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410228.435991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410228.541086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410228.671365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410228.791530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410228.914720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410229.048417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410229.169946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410229.292132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410229.419719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410229.535470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410229.667690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410229.783743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410229.914109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410230.032295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410230.165929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410230.284415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410230.419892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410230.538265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410230.668195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410230.792122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410230.914720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410231.052337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410231.178243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410231.307897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410231.432312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410231.560363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410231.689578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410231.837239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410231.981591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410232.104095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410232.243464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410232.359916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410232.490881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410232.613315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410232.742049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410232.869206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410232.992989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410233.119173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410233.253911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410233.377809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410233.507527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410233.637450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410233.769362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410233.898134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410234.027582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410234.159775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410234.294180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410234.412685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410234.539697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410234.672817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410234.801340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410234.919600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410235.047000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410235.165092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410235.298252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410235.418953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410235.544419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410235.668860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410235.795312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410235.910461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410236.046225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410236.167996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410236.296421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410236.428135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410236.551406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410236.677945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410236.819413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410236.950704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410237.066344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410237.198462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410237.334166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410237.460533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410237.593405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410237.718045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410237.851695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410237.989104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410238.101440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410238.237723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410238.367272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410238.492289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410238.648667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410238.754349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410238.888886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410239.009912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410239.158313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410239.277966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410239.417178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410239.528331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410239.663604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410239.794947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410239.926954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410240.049255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410240.176132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410240.301907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410240.455495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410240.563251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410240.707779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410240.821321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410240.963838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410241.090368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410241.217157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410241.350734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410241.473151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410241.601757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410241.732090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410241.855862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410241.990880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410242.096895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410242.231641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410242.351189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410242.491275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410242.620278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410242.731215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410242.857661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410242.985759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410243.123606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410243.237756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410243.363506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410243.488816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410243.605229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410243.736661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410243.862119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410244.003808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410244.124204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410244.256759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410244.376698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410244.522619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410244.632280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410244.780690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410244.907841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410245.021150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410245.173094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410245.291261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410245.415732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410245.542542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410245.663610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410245.797887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410245.925210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410246.050564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410246.177612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410246.314261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410246.438778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410246.563488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410246.689131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410246.826969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410246.950237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410247.089452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410247.216191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410247.346434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410247.474616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410247.604957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410247.719337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410247.874556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410247.983169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410248.112315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410248.232144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410248.378024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410248.486906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410248.613263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410248.737782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410248.878793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410248.994661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410249.125655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410249.273893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410249.416834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410249.537334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410249.666855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410249.789701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410249.920103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410250.039620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410250.170310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410250.435803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410250.866724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410251.107795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410251.297177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410251.490325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410251.664237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410251.865127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410252.050411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410252.237071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410252.368850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410252.553545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410252.735030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410252.907535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410253.091206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410253.253257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410253.437532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410253.665373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410253.793855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410253.925016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410254.108439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410254.268564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410254.428824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410254.620228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410254.780138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410254.979091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410255.124199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410255.294849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410255.542297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410255.743780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410255.876327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410256.001526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410256.125989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410256.253047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410256.388016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410256.529130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410256.663992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410256.794654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410256.920941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410257.045700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410257.172888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410257.300944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410257.440084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410257.551666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410257.683479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410257.809847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410257.937149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410258.079625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410258.210274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410258.343867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410258.471457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410258.713612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410258.849697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410258.985445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410259.105616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410259.237338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410259.374604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410259.494485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410259.616244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410259.779396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410259.899138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410260.031237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410260.154143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410260.283194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410260.416908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410260.547011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410260.664252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410260.812201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410260.924732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410261.051145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410261.190062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410261.302072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410261.434790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410261.579073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410261.707642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410261.856732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410261.972177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410262.115590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410262.225588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410262.357590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410262.482051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410262.618658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410262.731813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410262.857035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410262.978286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410263.112999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410263.231417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410263.356593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410263.472492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410263.608527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410263.732032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410263.923922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410264.046063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410264.204777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410264.302207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410264.430474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410264.565587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410264.695595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410264.819997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410264.967009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410265.085256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410265.210703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410265.340197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410265.477581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410265.604690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410265.746263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410265.853669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410265.988231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410266.106785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410266.238039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410266.372037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410266.499871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410266.626464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410266.759452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410266.886968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410267.026112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410267.164412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410267.301463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410267.411208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410267.546782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410267.676141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410267.803173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410267.926623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410268.058148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410268.180079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410268.305634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410268.452755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410268.580814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410268.694632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410268.834189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410268.963652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410269.093261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410269.223088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410269.352819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410269.478453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410269.611966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410269.734960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410269.872170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410270.003526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410270.141118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410270.270101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410270.405963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410270.537684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410270.660023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410270.781915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410270.916628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410271.047233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410271.161777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410271.291674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410271.421907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410271.543802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410271.687383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410271.800940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410271.927940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410272.053628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410272.182986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410272.300843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410272.450311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410272.559001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410272.707401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410272.832510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410272.969678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410273.086524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410273.222937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410273.346763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410273.480659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410273.604882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410273.736803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410273.862908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410273.987905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410274.113415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410274.257438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410274.394304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410274.533675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410274.665211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410274.789221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410274.911593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410275.037098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410275.161201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410275.288609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410275.414121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410275.536115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410275.677235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410275.814147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410275.945067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410276.087865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410276.225710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410276.357989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410276.474571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410276.612091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410276.727841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410276.860985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410276.978557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410277.111940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410277.230935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410277.361299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410277.481942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410277.607377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410277.739189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410277.875280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410278.013942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410278.150825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410278.280157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410278.414425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410278.540448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410278.660744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410278.786130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410278.918847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410279.062951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410279.166314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410279.293741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410279.413226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410279.537340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410279.684456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410279.795385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410279.926053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410280.053287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410280.189166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410280.310561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410280.439420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410280.561352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410280.694394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410280.820736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410280.957509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410281.092908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410281.228970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410281.354503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410281.486542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410281.618717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410281.737955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410281.865266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410282.002617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410282.142936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410282.276542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410282.398492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410282.532909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410282.661114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410282.791029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410282.914200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410283.062848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410283.164334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410283.299164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410283.417423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410283.552855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410283.674078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410283.810095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410283.940722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410284.075593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410284.200202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410284.330772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410284.465350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410284.593777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410284.735834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410284.863752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410284.985767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410285.128301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410285.241533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410285.372447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410285.502140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410285.634212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410285.770228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410285.902565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410286.033184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410286.204932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410286.461754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410286.734098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410286.984455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410287.106371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410287.237424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410287.355705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410287.481738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410287.600476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410287.731394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410287.854486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410287.985364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410288.114923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410288.253883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410288.376141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410288.507880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410288.660841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410288.799842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410288.919391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410289.048761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410289.188424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410289.299446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410289.425070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410289.551539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410289.694336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410289.826641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410289.958180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410290.075823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410290.216339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410290.350269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410290.475544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410290.604792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410290.722811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410290.852409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410290.972000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410291.105118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410291.230068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410291.357162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410291.481373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410291.605967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410291.745039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410291.889832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410292.007220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410292.148364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410292.285021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410292.437217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410292.548292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410292.674928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410292.801661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410292.931470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410293.053817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410293.198395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410293.311801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410293.439417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410293.570816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410293.710581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410293.845465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410293.973040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410294.102830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410294.230521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410294.356199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410294.483579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410294.608778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410294.734682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410294.855924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410294.984225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410295.109688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410295.230189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410295.356038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410295.480624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410295.606210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410295.734499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410295.860618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410295.991050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410296.121260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410296.252099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410296.391270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410296.525802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410296.653374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410296.788600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410296.910374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410297.051255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410297.172846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410297.296306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410297.423665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410297.546422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410297.671196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410297.797561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410297.920596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410298.062859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410298.172668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410298.296538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410298.425527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410298.559777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410298.687693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410298.809489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410298.935758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410299.086898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410299.221221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410299.335482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410299.478353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410299.605705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410299.733156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410299.856009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410299.988616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410300.116041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410300.231776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410300.358619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410300.502707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410300.620363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410300.749835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410300.872873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410301.011198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410301.153822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410301.274462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410301.416000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410301.539283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410301.684871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410301.791336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410301.929312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410302.047794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410302.174504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410302.302881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410302.423241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410302.545773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410302.688968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410302.798954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410302.932437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410303.058348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410303.192599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410303.317041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410303.449669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410303.583229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410303.727128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410303.857778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410303.985442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410304.105269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410304.230774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410304.357596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410304.480100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410304.609414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410304.732150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410304.854050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410304.987292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410305.127614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410305.252326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410305.359200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410305.484198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410305.629247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410305.742092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410305.874117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410306.021301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410306.148399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410306.268773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410306.400184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410306.533189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410306.660079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410306.792837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410306.905866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410307.052993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410307.167782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410307.295032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410307.424627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410307.552630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410307.677235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410307.805300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410307.926025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410308.055832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410308.195504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410308.321453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410308.458203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410308.597923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410308.718716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410308.851197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410308.982085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410309.113797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410309.236423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410309.370831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410309.502392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410309.642145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410309.785812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410309.906589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410310.027160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410310.159461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410310.287934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410310.415256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410310.538220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410310.666985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410310.783632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410310.982886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410311.120975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410311.270767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410311.396682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410311.540472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410311.665620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410311.796643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410311.924142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410312.052628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410312.180092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410312.312739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410312.449234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410312.581921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410312.712310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410312.843999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410312.969718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410313.106819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410313.227219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410313.354673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410313.492344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410313.610200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410313.748568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410313.871568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410313.999358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410314.147791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410314.265514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410314.410106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410314.528865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410314.659722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410314.783916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410314.916356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410315.034244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410315.167103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410315.286899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410315.415038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410315.538294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410315.672361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410315.786797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410315.918704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410316.044788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410316.177603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410316.300799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410316.428422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410316.551434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410316.693182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410316.829609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410316.964110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410317.087842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410317.215513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410317.350148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410317.476115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410317.597819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410317.725699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410317.848234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410317.976052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410318.104889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410318.231669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410318.350881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410318.483459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410318.603457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410318.737037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410318.853065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410318.998477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410319.111120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410319.240325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410319.372590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410319.499625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410319.640614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410319.785838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410319.914680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410320.041647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410320.182428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410320.303097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410320.420663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410320.555947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410320.676549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410320.806459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410320.936490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410321.083596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410321.203775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410321.347009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410321.470286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410321.603655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410321.757980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410321.896337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410322.021829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410322.161016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410322.287425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410322.408749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410322.533452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410322.655626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410322.795410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410322.921314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410323.044730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410323.169830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410323.297543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410323.427154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410323.560232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410323.693946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410323.835120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410323.962904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410324.090731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410324.232879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410324.345179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410324.484042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410324.611913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410324.731334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410324.851861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410324.981676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410325.101564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410325.249265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410325.359298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410325.497239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410325.613518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410325.742827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410325.873776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410326.004791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410326.133081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410326.263079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410326.395889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410326.522923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410326.653934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410326.775757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410326.905931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410327.020278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410327.160789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410327.293612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410327.414850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410327.537007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410327.672244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410327.798805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410327.918536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410328.045869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410328.176110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410328.299363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410328.435523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410328.566515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410328.697213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410328.846927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410328.961846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410329.096509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410329.214993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410329.351635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410329.474073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410329.600904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410329.736611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410329.857366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410329.981678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410330.115834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410330.236945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410330.354158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410330.487005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410330.614947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410330.735761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410330.869214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410330.992567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410331.124376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410331.277956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410331.389572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410331.519343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410331.665042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410331.775555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410331.907787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410332.041898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410332.159740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410332.302357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410332.413672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410332.549580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410332.674254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410332.801639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410332.934522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410333.060546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410333.188663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410333.320264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410333.451838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410333.584475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410333.719277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410333.860452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410333.973695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410334.100274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410334.248021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410334.371069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410334.490157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410334.610025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410334.736472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410334.853360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410334.988620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410335.105642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410335.232982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410335.358084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410335.489522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410335.611064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410335.775235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410335.892252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410336.033995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410336.167406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410336.284349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410336.403032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410336.558596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410336.654629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410336.798411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410336.912041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410337.039560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410337.170174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410337.291915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410337.411511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410337.546242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410337.662411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410337.796896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410337.923568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410338.052299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410338.186900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410338.319941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410338.440032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410338.585800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410338.722076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410338.845706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410338.970692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410339.106310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410339.229623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410339.357216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410339.486197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410339.613108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410339.749996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410339.864678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410340.000294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410340.141103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410340.270523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410340.411830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410340.527526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410340.659549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410340.782575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410340.912872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410341.041089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410341.165821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410341.287502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410341.432979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410341.542964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410341.664372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410341.797950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410341.939745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410342.071666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410342.200517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410342.331024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410342.463393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410342.604827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410342.728312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410342.853817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410342.981965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410343.123337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410343.228700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410343.357980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410343.483193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410343.600593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410343.736346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410343.850865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410343.980853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410344.120384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410344.254671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410344.392895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410344.517359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410344.644909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410344.781233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410344.903681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410345.037244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410345.158288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410345.289922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410345.412532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410345.538881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410345.664626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410345.793138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410345.916237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410346.033922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410346.161413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410346.282246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410346.413532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410346.539514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410346.660917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410346.786769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410346.913874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410347.040801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410347.159652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410347.293071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410347.408668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410347.542381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410347.665364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410347.786159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410347.927145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410348.059394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410348.192489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410348.333175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410348.469906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410348.599497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410348.728708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410348.856042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410348.971126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410349.104759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410349.246750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410349.358850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410349.484007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410349.612364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410349.739013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410349.871693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410350.010805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410350.157778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410350.280215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410350.414782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410350.533443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410350.665949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410350.795265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410350.923752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410351.067930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410351.175857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410351.307178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410351.441329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410351.581893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410351.728880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410351.855125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410351.980494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410352.099217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410352.235255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410352.361121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410352.482736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410352.602547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410352.731202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410352.857318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410352.987475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410353.116435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410353.246409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410353.384320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410353.506738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410353.661801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410353.790796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410353.914385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410354.045501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410354.175049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410354.301825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410354.435007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410354.561779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410354.683922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410354.809523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410354.939843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410355.081188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410355.214552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410355.349627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410355.471849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410355.619479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410355.727890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410355.887405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410355.981658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410356.109489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410356.231535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410356.378360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410356.484220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410356.610329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410356.732584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410356.862160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410356.989717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410357.111457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410357.239569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410357.372768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410357.517022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410357.650396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410357.785718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410357.897596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410358.030818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410358.162256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410358.284582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410358.414579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410358.543202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410358.672618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410358.794763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410358.918147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410359.055491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410359.191304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410359.298918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410359.451240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410359.561045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410359.687075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410359.828198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410359.959841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410360.091458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410360.214193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410360.335036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410360.468536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410360.613636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410360.727637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410360.854110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410360.981619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410361.103749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410361.227975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410361.351140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410361.472971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410361.602151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410361.727936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410361.853532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410361.983087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410362.121058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410362.233523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410362.350475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410362.483745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410362.619821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410362.732442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410362.856391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410362.988030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410363.111068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410363.242764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410363.377215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410363.517690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410363.646434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410363.771503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410363.902264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410364.040687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410364.181730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410364.290062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410364.414014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410364.544665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410364.673792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410364.797246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410364.923667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410365.058170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410365.175421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410365.301132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410365.432304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410365.556341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410365.696470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410365.818657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410365.953849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410366.102559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410366.221123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410366.353658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410366.475393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410366.608096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410366.722547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410366.854607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410366.978265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410367.108783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410367.230972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410367.352467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410367.479868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410367.607730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410367.730333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410367.853753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410367.976426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410368.120219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410368.231848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410368.360020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410368.482136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410368.636616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410368.745778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410368.871100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410369.017301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410369.151002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410369.266704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410369.384548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410369.518681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410369.659904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410369.777724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410369.904743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410370.028189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410370.153271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410370.279872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410370.435253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410370.638544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410371.020495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410371.300027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410371.519991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410371.712489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410371.877359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410372.051643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410372.229323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410372.386733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410372.545082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410372.718229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410372.890899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410373.058994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410373.284619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410373.423545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410373.591448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410373.802739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410373.983650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410374.143091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410374.281899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410374.457482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410374.645901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410374.826940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410374.942920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410375.121284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410375.309824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410375.486005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410375.647471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410375.925760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410376.053366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410376.184088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410376.307396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410376.440588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410376.571314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410376.714395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410376.848600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410376.979446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410377.103469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410377.224540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410377.355126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410377.479077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410377.622795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410377.725515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410377.855165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410377.981663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410378.107741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410378.231375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410378.368341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410378.496083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410378.623593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410378.749914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410378.936836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410379.147823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410379.276116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410379.411388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410379.538237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410379.663691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410379.809224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410379.948978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410380.061100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410380.187488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410380.331718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410380.456831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410380.575837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410380.720489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410380.842822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410380.977011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410381.097279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410381.225568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410381.343601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410381.479995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410381.600808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410381.736222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410381.872425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410381.998170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410382.126588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410382.268456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410382.392737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410382.525975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410382.642823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410382.764808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410382.895353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410383.023934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410383.162127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410383.295464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410383.410924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410383.538739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410383.680542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410383.796559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410383.943168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410384.050943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410384.204964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410384.344417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410384.472674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410384.591237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410384.717408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410384.842508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410384.968274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410385.092494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410385.213058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410385.346439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410385.471101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410385.601164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410385.726145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410385.850479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410385.976091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410386.098886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410386.228335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410386.352722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410386.476689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410386.601150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410386.725027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410386.868845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410386.983654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410387.124035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410387.240724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410387.371784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410387.500517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410387.633856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410387.770552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410387.912982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410388.031178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410388.159480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410388.288749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410388.418742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410388.549823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410388.683506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410388.806785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410388.935218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410389.090456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410389.210165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410389.339823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410389.472940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410389.601138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410389.731527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410389.856647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410389.985432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410390.116922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410390.240162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410390.376796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410390.515724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410390.643148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410390.774817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410390.904750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410391.040500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410391.158981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410391.301578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410391.423744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410391.546287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410391.670700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410391.790109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410391.925538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410392.049119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410392.182015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410392.311396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410392.433028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410392.571912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410392.704035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410392.832741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410392.960119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410393.090940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410393.222578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410393.348486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410393.471297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410393.596929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410393.718513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410393.851558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410393.975748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410394.103515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410394.227522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410394.359938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410394.488550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410394.615276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410394.746472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410394.900512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410395.016019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410395.151296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410395.266524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410395.398226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410395.520489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410395.649825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410395.785594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410395.910638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410396.034530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410396.165611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410396.286531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410396.411906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410396.541495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410396.663223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410396.786147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410396.917290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410397.039061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410397.165869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410397.294569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410397.421849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410397.541879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410397.671360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410397.793868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410397.912453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410398.044255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410398.168052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410398.289351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410398.425110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410398.540567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410398.687291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410398.814991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410398.923887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410399.059891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410399.185874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410399.308936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410399.436328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410399.580763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410399.716233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410399.835920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410399.952780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410400.105885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410400.240320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410400.347672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410400.469946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410400.603323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410400.743458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410400.872825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410401.003690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410401.137081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410401.269244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410401.405704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410401.541838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410401.670830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410401.787817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410401.931516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410402.050452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410402.180186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410402.310879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410402.436762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410402.565416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410402.699899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410402.836109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410402.963491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410403.096475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410403.226949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410403.357474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410403.474916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410403.598432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410403.725656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410403.872329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410403.983231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410404.107607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410404.234054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410404.367225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410404.497809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410404.623699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410404.767466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410404.902309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410405.033779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410405.164477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410405.298347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410405.418825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410405.544576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410405.672648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410405.799174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410405.931398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410406.057975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410406.190026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410406.316313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410406.461416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410406.591720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410406.728686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410406.841150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410406.973007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410407.091786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410407.227509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410407.353291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410407.477732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410407.603930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410407.729662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410407.859898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410407.996966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410408.115747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410408.254923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410408.372335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410408.502106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410408.645679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410408.780341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410408.913822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410409.041944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410409.171223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410409.299365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410409.426192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410409.558104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410409.687092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410409.816597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410409.941792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410410.078427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410410.222551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410410.337990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410410.460361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410410.590616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410410.718788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410410.842184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410410.970894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410411.100266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410411.228883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410411.351604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410411.474695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410411.605910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410411.737270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410411.871871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410412.007708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410412.146107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410412.278064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410412.404547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410412.530982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410412.659848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410412.792822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410412.908922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410413.033210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410413.166416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410413.289726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410413.432577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410413.546936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410413.674330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410413.810993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410413.935726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410414.061817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410414.204974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410414.329939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410414.465982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410414.596396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410414.704815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410414.834033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410414.968009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410415.092091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410415.227520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410415.347556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410415.471808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410415.595783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410415.723339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410415.846097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410415.965925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410416.093147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410416.223774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410416.338259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410416.477439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410416.612927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410416.718927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410416.844357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410416.988240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410417.093247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410417.224415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410417.355625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410417.495902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410417.603601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410417.724348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410417.845496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410417.974369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410418.101309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410418.226737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410418.357827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410418.478515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410418.599159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410418.728170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410418.852613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410418.996122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410419.109911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410419.234605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410419.382587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410419.503570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410419.642478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410419.770786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410419.896346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410420.032785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410420.164449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410420.282500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410420.423027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410420.546086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410420.666687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410420.789840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410420.913184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410421.045203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410421.167459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410421.295824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410421.418217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410421.544479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410421.674605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410421.795393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410421.944096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410422.061019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410422.200279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410422.312333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410422.447831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410422.580703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410422.712983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410422.835025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410422.968269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410423.094627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410423.233604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410423.348950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410423.474758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410423.600465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410423.732433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410423.850079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410423.973451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410424.101468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410424.226251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410424.354469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410424.474272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410424.602129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410424.737190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410424.847338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410424.976840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410425.100110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410425.226414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410425.353545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410425.476619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410425.606988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410425.742933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410425.882201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410425.996338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410426.141035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410426.263801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410426.406260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410426.540945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410426.657279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410426.782151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410426.908251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410427.036105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410427.161189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410427.289249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410427.409907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410427.536156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410427.667963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410427.796295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410427.924046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410428.059220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410428.182955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410428.313195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410428.444513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410428.578814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410428.714408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410428.844502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410428.979516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410429.111946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410429.234796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410429.364048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410429.493193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410429.634149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410429.747001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410429.877284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410429.999315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410430.144864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410430.275097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410430.410579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410430.545893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410430.671904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410430.799164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410430.934052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410431.068449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410431.203633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410431.329280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410431.453875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410431.588733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410431.715521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410431.849755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410431.979108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410432.101567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410432.223552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410432.356309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410432.482225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410432.607139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410432.731627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410432.851032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410432.983789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410433.117939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410433.244899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410433.368783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410433.509950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410433.637020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410433.783004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410433.905229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410434.038738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410434.158532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410434.279040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410434.406763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410434.534446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410434.662957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410434.781198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410434.907640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410435.030015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410435.170144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410435.283006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410435.412615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410435.543446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410435.670626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410435.791259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410435.932412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410436.045987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410436.171449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410436.299573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410436.428022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410436.546747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410436.680608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410436.799423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410436.933259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410437.053899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410437.186184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410437.335968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410437.456881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410437.597067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410437.713203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410437.847365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410437.982920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410438.107804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410438.228701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410438.355851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410438.478950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410438.597143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410438.725369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410438.841003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410438.969093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410439.098278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410439.234415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410439.363209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410439.484298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410439.607275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410439.757142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410439.887751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410440.037060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410440.152997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410440.275524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410440.413472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410440.544002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410440.671465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410440.825021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410440.951555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410441.078051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410441.212363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410441.336744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410441.478601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410441.606254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410441.745566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410441.882582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410442.018751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410442.153054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410442.281006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410442.407858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410442.534357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410442.680622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410442.791584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410442.915308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410443.042822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410443.170603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410443.302163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410443.450418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410443.557750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410443.724878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410443.842498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410443.989190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410444.093206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410444.213202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410444.344105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410444.464322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410444.593629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410444.722650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410444.843112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410444.974159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410445.094716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410445.225263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410445.349090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410445.474032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410445.599931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410445.728324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410445.862359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410445.984301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410446.104717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410446.235069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410446.370289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410446.494137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410446.619418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410446.744956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410446.875359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410447.027676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410447.149321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410447.273171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410447.395164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410447.527098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410447.654828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410447.789829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410447.911371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410448.043401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410448.163826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410448.290781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410448.413975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410448.539890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410448.675121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410448.804257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410448.939025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410449.047657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410449.181195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410449.306504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410449.446456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410449.556784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410449.699021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410449.830685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410449.976266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410450.094848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410450.221569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410450.349984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410450.474622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410450.619315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410450.728690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410450.860833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410450.975984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410451.106254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410451.245788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410451.352595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410451.480354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410451.601300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410451.743431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410451.853321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410451.993521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410452.103846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410452.229704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410452.360522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410452.481566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410452.614803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410452.740368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410452.879265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410453.003659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410453.129907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410453.280735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410453.410631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410453.536432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410453.663160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410453.782247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410453.909906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410454.030591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410454.167567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410454.291392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410454.421431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410454.558825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410454.688035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410454.810219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410454.932479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410455.074084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410455.204645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410455.356332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410455.475020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410455.590371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410455.746197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410455.871966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410455.980459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410456.106718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410456.236119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410456.354675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410456.499520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410456.613306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410456.736526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410456.877251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410457.015851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410457.137406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410457.285867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410457.400473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410457.538841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410457.659737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410457.785032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410457.909697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410458.038351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410458.153318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410458.287800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410458.397505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410458.525570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410458.647422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410458.784283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410458.910757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410459.040479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410459.167846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410459.289555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410459.406439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410459.527874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410459.659380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410459.785326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410459.909098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410460.049541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410460.161615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410460.290640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410460.411869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410460.544920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410460.669085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410460.796314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410460.923626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410461.067250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410461.190709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410461.327719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410461.453808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410461.593324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410461.722667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410461.845887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410461.967650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410462.091257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410462.226148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410462.357013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410462.494871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410462.637121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410462.758970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410462.891263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410463.002060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410463.151013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410463.274850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410463.404117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410463.529112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410463.663852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410463.787610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410463.916242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410464.036186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410464.164641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410464.286853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410464.403797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410464.526692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410464.660216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410464.773520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410464.900181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410465.024010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410465.156259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410465.291999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410465.416001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410465.544239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410465.670170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410465.794788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410465.924426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410466.052576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410466.180075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410466.306478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410466.432902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410466.571064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410466.707134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410466.829147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410466.962465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410467.089248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410467.224385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410467.341718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410467.474103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410467.591823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410467.721441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410467.851976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410467.977800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410468.105655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410468.230084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410468.351647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410468.473496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410468.594586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410468.732209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410468.867756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410468.971426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410469.102074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410469.232391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410469.356345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410469.495036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410469.614138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410469.739909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410469.873859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410470.007459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410470.149565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410470.274571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410470.396487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410470.532161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410470.648049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410470.778282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410470.922040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410471.030018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410471.157098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410471.290466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410471.414951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410471.535436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410471.660713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410471.800000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410471.925042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410472.047474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410472.201525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410472.341820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410472.468194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410472.593255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410472.712047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410472.845983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410472.971913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410473.106231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410473.223340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410473.348565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410473.482655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410473.606561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410473.736686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410473.867257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410473.992223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410474.150482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410474.272025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410474.406737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410474.522519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410474.658719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410474.782753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410474.919823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410475.034063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410475.158724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410475.284898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410475.418631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410475.530408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410475.669041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410475.787563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410475.921011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410476.042499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410476.165773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410476.289926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410476.433172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410476.563546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410476.706710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410476.831419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410476.972499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410477.093264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410477.220845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410477.349190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410477.474267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410477.595380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410477.727426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410477.863735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410477.979539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410478.106141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410478.243753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410478.356203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410478.487246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410478.607911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410478.735324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410478.869222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410479.012439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410479.137010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410479.293032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410479.410689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410479.539405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410479.676884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410479.784333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410479.917552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410480.036053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410480.157177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410480.285492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410480.411664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410480.537189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410480.660309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410480.805523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410480.911784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410481.040526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410481.168415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410481.287899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410481.421223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410481.530936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410481.661307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410481.788792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410481.915274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410482.041205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410482.171324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410482.289530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410482.415891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410482.543626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410482.682688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410482.794101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410482.918644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410483.045908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410483.170434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410483.299756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410483.421567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410483.554475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410483.678654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410483.812423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410483.952384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410484.075426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410484.210599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410484.339306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410484.463940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410484.609078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410484.716504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410484.850237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410484.975437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410485.100483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410485.222646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410485.352025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410485.477058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410485.596210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410485.721722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410485.849714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410485.969989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410486.101660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410486.219000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410486.348581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410486.463139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410486.598737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410486.723807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410486.853634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410486.971812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410487.096963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410487.226373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410487.345455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410487.469824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410487.604879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410487.725621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410487.866627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410487.977369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410488.103085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410488.224251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410488.348791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410488.471529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410488.602249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410488.724516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410488.853285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410488.978834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410489.111396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410489.236346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410489.378441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410489.492103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410489.608934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410489.744097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410489.889374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410490.015310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410490.149063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410490.274080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410490.410118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410490.522442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410490.654071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410490.783499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410490.912018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410491.047776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410491.161299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410491.286013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410491.409726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410491.669332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410491.992772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410492.201982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410492.471506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410492.640530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410492.824570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410492.991921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410493.169317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410493.398679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410493.528631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410493.720967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410493.887923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410494.056339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410494.245158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410494.434657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410494.608497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410494.767985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410494.946308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410495.184958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410495.327387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410495.483603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410495.656794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410495.819698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410496.004507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410496.177726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410496.329878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410496.528701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410496.721142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410496.905819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410497.119794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410497.314227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410497.432110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410497.554737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410497.689336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410497.824264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410497.952863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410498.092001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410498.241200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410498.341606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410498.490007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410498.619251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410498.730056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410498.850576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410498.981364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410499.107887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410499.232593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410499.384535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410499.504557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410499.620740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410499.778571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410499.898488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410500.041873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410500.197364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410500.403064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410500.532729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410500.662644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410500.777549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410500.909357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410501.035610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410501.163522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410501.287520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410501.419708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410501.539809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410501.677762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410501.822803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410501.960351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410502.080894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410502.235965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410502.335994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410502.464296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410502.598366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410502.718328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410502.845879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410502.976272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410503.097578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410503.219825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410503.353011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410503.490641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410503.603226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410503.742950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410503.853365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410503.980808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410504.110188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410504.230869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410504.367219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410504.491393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410504.608826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410504.758855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410504.887087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410505.010500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410505.143727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410505.273305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410505.417110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410505.550932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410505.676013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410505.819932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410505.951692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410506.080612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410506.208591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410506.343795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410506.456992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410506.586019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410506.709120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410506.834638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410506.968242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410507.089463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410507.226312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410507.359455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410507.470198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410507.603714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410507.731627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410507.863228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410507.998966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410508.117364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410508.257106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410508.409682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410508.517430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410508.652291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410508.776249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410508.916631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410509.035957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410509.181035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410509.286933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410509.419425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410509.535822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410509.665766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410509.793955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410509.930787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410510.052024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410510.180074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410510.317280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410510.452825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410510.586125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410510.717838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410510.838363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410510.971556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410511.090122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410511.226809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410511.346662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410511.474662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410511.591931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410511.725665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410511.849893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410511.972916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410512.097562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410512.220598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410512.339542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410512.483378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410512.596865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410512.725908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410512.839083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410512.971194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410513.098090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410513.228117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410513.344289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410513.489420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410513.595117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410513.725472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410513.855518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410513.992317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410514.120148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410514.239333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410514.369321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410514.498060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410514.631556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410514.769582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410514.901164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410515.027645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410515.149582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410515.290806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410515.408865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410515.531902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410515.664689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410515.800696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410515.927455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410516.060294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410516.202441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410516.337063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410516.461071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410516.587858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410516.723857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410516.846588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410516.969134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410517.099257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410517.220540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410517.352188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410517.475977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410517.602540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410517.732777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410517.864234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410517.991921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410518.119879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410518.251114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410518.393620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410518.521967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410518.646442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410518.773726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410518.905548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410519.028791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410519.156737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410519.289967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410519.418618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410519.532715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410519.660431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410519.784103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410519.912323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410520.056192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410520.165595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410520.294526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410520.427913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410520.559994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410520.682789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410520.828490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410520.966877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410521.093372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410521.225802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410521.358981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410521.484830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410521.602247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410521.741894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410521.858304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410521.993963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410522.119780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410522.248765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410522.377237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410522.514116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410522.650122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410522.781946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410522.900769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410523.027254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410523.157986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410523.282309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410523.409946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410523.533638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410523.667311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410523.783394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410523.907170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410524.039364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410524.159195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410524.279412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410524.408473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410524.535601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410524.670110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410524.785094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410524.910648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410525.038802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410525.168838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410525.293607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410525.415044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410525.540279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410525.668454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410525.811899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410525.928293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410526.076710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410526.195784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410526.325998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410526.454503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410526.582428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410526.708049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410526.833795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410526.958727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410527.091272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410527.216990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410527.345689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410527.473341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410527.597677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410527.715688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410527.856383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410527.972995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410528.116436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410528.229331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410528.355807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410528.473806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410528.601353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410528.720045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410528.860397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410528.974655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410529.105408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410529.228055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410529.351080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410529.475797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410529.603455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410529.726410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410529.848386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410529.974131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410530.100554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410530.227446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410530.358427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410530.496162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410530.621229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410530.749803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410530.882679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410531.012412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410531.144382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410531.275736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410531.397622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410531.523915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410531.660130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410531.789855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410531.916752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410532.056201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410532.177588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410532.307066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410532.427806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410532.567065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410532.697570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410532.820836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410532.962154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410533.084560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410533.208616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410533.339200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410533.457358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410533.595297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410533.720800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410533.844782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410533.977562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410534.096424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410534.223691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410534.363959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410534.492927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410534.604390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410534.720755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410534.851434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410534.980727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410535.105866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410535.233711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410535.360599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410535.491955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410535.628842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410535.764163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410535.899735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410536.027317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410536.146979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410536.285234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410536.408192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410536.551745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410536.661114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410536.790930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410536.909090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410537.038761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410537.160143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410537.281408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410537.408677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410537.558830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410537.666919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410537.796690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410537.934166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410538.051850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410538.179952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410538.326073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410538.451414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410538.580319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410538.709078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410538.828094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410538.953857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410539.094545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410539.223779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410539.356287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410539.478031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410539.601364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410539.732528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410539.863861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410539.989873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410540.114784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410540.244282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410540.378719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410540.515046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410540.653231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410540.772769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410540.912604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410541.028783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410541.154422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410541.275677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410541.419737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410541.542427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410541.666432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410541.782073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410541.908845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410542.033149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410542.156653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410542.280707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410542.408778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410542.534240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410542.677681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410542.784901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410542.912450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410543.044377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410543.171444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410543.290234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410543.419293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410543.550289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410543.703495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410543.817805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410543.954364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410544.080450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410544.209325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410544.339249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410544.466447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410544.590179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410544.726645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410544.844307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410544.990450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410545.097083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410545.230529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410545.344861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410545.472158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410545.601649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410545.724888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410545.856619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410545.994246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410546.115431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410546.263023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410546.387514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410546.514904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410546.652295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410546.785789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410546.904883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410547.030716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410547.152911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410547.284528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410547.402226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410547.534996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410547.650942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410547.780936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410547.911140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410548.047572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410548.175280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410548.284061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410548.412434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410548.539573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410548.662445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410548.805882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410548.933971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410549.068082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410549.191808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410549.329851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410549.450225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410549.573464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410549.705301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410549.834784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410549.955644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410550.092782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410550.213723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410550.350604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410550.469634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410550.613911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410550.719128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410550.850508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410550.990260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410551.100986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410551.228306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410551.367537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410551.479394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410551.614106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410551.740425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410551.880801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410552.012758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410552.140075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410552.275837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410552.409365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410552.533608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410552.665673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410552.779459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410552.910401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410553.052522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410553.174186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410553.302363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410553.430801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410553.559333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410553.696625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410553.829518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410553.952664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410554.093363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410554.219497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410554.353847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410554.474922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410554.594922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410554.740458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410554.849218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410554.972354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410555.101810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410555.227201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410555.340040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410555.474162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410555.602577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410555.731417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410555.852747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410555.977620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410556.099556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410556.243043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410556.343364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410556.465600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410556.595288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410556.716932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410556.845278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410556.973527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410557.094211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410557.227791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410557.354699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410557.490933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410557.604389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410557.733073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410557.866701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410557.996300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410558.125214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410558.271477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410558.400331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410558.529325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410558.646780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410558.777790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410558.897482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410559.024666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410559.160060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410559.292279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410559.425306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410559.542594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410559.676618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410559.807179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410559.946693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410560.084347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410560.203636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410560.338896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410560.455256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410560.588396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410560.712583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410560.834091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410560.969912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410561.097642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410561.235944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410561.345424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410561.472356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410561.597355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410561.761156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410561.880227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410561.998086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410562.137678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410562.268806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410562.398898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410562.524906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410562.657250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410562.776760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410562.899440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410563.029254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410563.149437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410563.271499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410563.398619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410563.519694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410563.659559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410563.783146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410563.911813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410564.036476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410564.161426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410564.290260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410564.412414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410564.530648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410564.676734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410564.788327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410564.921492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410565.054617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410565.186798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410565.309995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410565.443751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410565.578285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410565.713258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410565.844826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410565.978176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410566.090838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410566.221006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410566.345866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410566.474969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410566.593550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410566.715962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410566.842165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410566.969457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410567.088359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410567.232598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410567.344118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410567.473884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410567.588924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410567.722615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410567.844239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410567.973616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410568.097723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410568.223289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410568.349837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410568.475641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410568.595300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410568.723888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410568.844491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410568.972072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410569.096110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410569.212520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410569.352989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410569.472783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410569.588779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410569.719101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410569.847001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410569.975952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410570.100754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410570.229140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410570.365270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410570.491089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410570.616189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410570.770419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410570.879211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410571.014923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410571.142982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410571.279633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410571.407452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410571.539299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410571.655464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410571.790590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410571.908399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410572.036250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410572.158118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410572.289042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410572.403169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410572.533833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410572.654321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410572.784000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410572.911763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410573.032959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410573.155852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410573.290522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410573.414069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410573.559899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410573.666332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410573.796606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410573.913923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410574.045699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410574.198595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410574.314514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410574.444282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410574.580274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410574.714824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410574.840684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410574.967280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410575.099003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410575.209533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410575.344870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410575.485100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410575.603639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410575.745158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410575.886557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410576.016473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410576.143746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410576.261538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410576.405172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410576.521701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410576.657540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410576.791888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410576.908865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410577.036173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410577.176091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410577.286825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410577.411765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410577.528382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410577.663126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410577.781782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410577.908163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410578.038109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410578.162173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410578.286396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410578.425575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410578.535486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410578.659769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410578.787218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410578.923650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410579.039957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410579.175565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410579.303595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410579.448325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410579.572564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410579.702295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410579.832999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410579.956592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410580.098822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410580.224172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410580.352834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410580.486247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410580.605565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410580.728953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410580.870351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410580.980456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410581.110980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410581.237288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410581.366889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410581.492319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410581.615175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410581.748744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410581.893090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410582.033985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410582.152580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410582.279806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410582.397803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410582.532066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410582.657140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410582.785472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410582.905931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410583.031149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410583.156610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410583.283096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410583.408072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410583.540475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410583.656973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410583.794352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410583.914849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410584.037603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410584.165987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410584.302295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410584.430276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410584.555937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410584.678446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410584.809323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410584.948605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410585.088532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410585.205618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410585.338099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410585.467253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410585.598208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410585.715783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410585.842810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410585.975297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410586.098407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410586.290035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410586.564787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410586.674080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410586.800644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410586.941914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410587.058639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410587.196981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410587.333312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410587.457000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410587.588923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410587.708716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410587.844831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410587.968028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410588.096505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410588.222999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410588.346996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410588.471062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410588.598778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410588.723680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410588.847862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410588.973116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410589.102221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410589.227254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410589.374869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410589.501717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410589.607279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410589.754604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410589.864537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410589.991970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410590.120501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410590.261062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410590.388154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410590.508833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410590.645357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410590.781247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410590.905977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410591.029917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410591.168504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410591.278671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410591.410587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410591.535209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410591.669636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410591.790535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410591.946482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410592.073220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410592.197507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410592.335939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410592.490412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410592.600461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410592.726617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410592.852237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410592.978907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410593.104705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410593.246409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410593.361313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410593.480678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410593.618479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410593.731876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410593.861607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410593.985791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410594.117562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410594.254103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410594.391341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410594.534739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410594.652426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410594.779014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410594.895692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410595.031516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410595.158264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410595.285154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410595.406059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410595.535012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410595.659689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410595.786257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410595.910152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410596.034707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410596.154932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410596.289681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410596.407975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410596.544023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410596.670020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410596.793060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410596.917497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410597.058998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410597.181497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410597.310827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410597.440208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410597.585522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410597.707596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410597.842008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410597.965532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410598.100408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410598.226980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410598.378516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410598.480901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410598.615440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410598.730325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410598.857059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410599.001283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410599.134986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410599.268311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410599.402492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410599.528861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410599.647399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410599.782245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410599.912890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410600.043499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410600.178460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410600.302872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410600.443225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410600.583210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410600.717502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410600.830206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410600.978778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410601.079769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410601.221400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410601.344898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410601.476953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410601.598819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410601.739789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410601.845473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410601.977578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410602.097574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410602.245051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410602.357850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410602.481892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410602.619181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410602.759562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410602.885756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410603.001688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410603.130687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410603.268155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410603.399271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410603.521308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410603.645556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410603.777863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410603.915147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410604.028364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410604.154047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410604.278833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410604.409734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410604.532973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410604.659985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410604.784399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410604.908540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410605.035213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410605.162371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410605.283190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410605.410808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410605.534029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410605.666376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410605.787390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410605.913235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410606.041305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410606.164192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410606.288379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410606.422362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410606.550400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410606.683117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410606.811638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410606.946388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410607.060560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410607.196005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410607.325090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410607.451075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410607.587945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410607.707410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410607.845192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410607.968745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410608.102126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410608.226782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410608.355982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410608.482568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410608.620541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410608.745558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410608.892013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410609.020666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410609.156943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410609.281214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410609.407743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410609.527250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410609.659902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410609.784939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410609.908297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410610.030912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410610.161354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410610.283506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410610.413300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410610.534243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410610.665130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410610.782602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410610.912741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410611.037140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410611.176429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410611.307530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410611.434846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410611.570498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410611.708698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410611.839840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410611.961799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410612.090917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410612.263343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410612.568115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410612.926167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410613.280271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410613.502239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410613.665566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410613.816989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410613.981147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410614.153538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410614.314292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410614.500456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410614.702039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410614.875277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410615.042795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410615.226971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410615.392033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410615.584170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410615.738462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410615.865372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410616.148770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410616.284976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410616.451444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410616.600430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410616.775324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410616.962663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410617.161753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410617.316263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410617.469051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410617.668597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410617.821909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410617.998130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410618.280130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410618.463384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410618.587684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410618.715250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410618.840855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410618.968703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410619.096672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410619.224855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410619.356442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410619.501574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410619.618258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410619.772691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410619.905853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410620.027028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410620.158175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410620.285354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410620.413627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410620.548992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410620.668029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410620.793874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410620.927873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410621.061650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410621.211576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410621.465726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410621.590118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410621.736905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410621.886126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410622.024299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410622.152339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410622.279052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410622.406336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410622.529240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410622.649051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410622.782325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410622.908454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410623.034924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410623.159986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410623.287951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410623.418347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410623.551885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410623.694141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410623.839097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410623.966156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410624.095168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410624.223752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410624.349346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410624.467950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410624.595124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410624.714585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410624.834588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410624.967611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410625.093277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410625.221176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410625.341999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410625.461354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410625.592171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410625.715221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410625.839905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410625.969926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410626.097156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410626.218926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410626.361607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410626.479791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410626.623170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410626.745179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410626.880408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410626.993206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410627.140264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410627.258461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410627.397510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410627.523158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410627.656847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410627.787911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410627.921778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410628.048472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410628.178342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410628.305768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410628.447345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410628.583036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410628.709435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410628.836756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410628.964765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410629.087396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410629.220272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410629.349133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410629.471737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410629.591981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410629.719508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410629.847613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410629.979709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410630.097251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410630.227090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410630.347294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410630.478085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410630.603543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410630.734804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410630.869774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410631.011569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410631.131790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410631.273572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410631.399307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410631.532143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410631.655457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410631.784222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410631.909365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410632.037438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410632.162771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410632.290507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410632.416885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410632.548203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410632.673357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410632.815119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410632.929496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410633.073210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410633.210027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410633.339028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410633.458146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410633.598169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410633.710537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410633.847185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410633.970319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410634.099122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410634.227732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410634.364488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410634.477719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410634.605502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410634.738108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410634.863901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410635.017665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410635.139785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410635.263764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410635.392042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410635.522605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410635.652244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410635.783261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410635.924614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410636.057191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410636.184133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410636.316107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410636.455900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410636.578151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410636.697650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410636.840309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410636.970917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410637.096530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410637.213118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410637.337514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410637.488163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410637.594910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410637.718830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410637.847723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410637.979188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410638.098532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410638.234858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410638.363698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410638.485833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410638.626729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410638.773563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410638.899737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410639.029282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410639.154773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410639.290339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410639.401803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410639.527924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410639.673741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410639.783807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410639.926464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410640.041962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410640.168333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410640.304481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410640.439313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410640.571075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410640.699932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410640.832113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410640.965145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410641.089324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410641.226885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410641.348820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410641.471872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410641.589578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410641.721926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410641.848054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410641.973573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410642.110377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410642.235600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410642.358197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410642.487096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410642.630037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410642.750944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410642.872139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410643.011395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410643.163650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410643.279719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410643.425116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410643.536846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410643.668643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410643.791093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410643.914771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410644.050754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410644.194990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410644.337515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410644.461298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410644.577783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410644.720944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410644.836488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410644.976060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410645.093049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410645.222313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410645.362391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410645.470804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410645.588737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410645.721926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410645.847768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410645.972608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410646.093488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410646.236604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410646.353750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410646.495192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410646.616787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410646.736028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410646.862194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410646.989958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410647.125326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410647.259388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410647.401584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410647.521333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410647.651629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410647.785824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410647.911562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410648.043960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410648.178476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410648.308362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410648.441592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410648.580058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410648.707548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410648.838691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410648.967889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410649.092577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410649.239082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410649.350404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410649.475579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410649.601904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410649.736511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410649.858935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410649.979877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410650.121978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410650.257272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410650.406942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410650.524711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410650.656061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410650.782122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410650.907360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410651.045813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410651.162446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410651.290414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410651.421362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410651.542277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410651.683357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410651.824082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410651.960248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410652.084536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410652.211428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410652.338603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410652.468977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410652.591387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410652.721856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410652.842062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410652.985562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410653.097074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410653.227414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410653.340029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410653.475444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410653.597552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410653.722896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410653.851374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410653.980075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410654.114766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410654.232866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410654.360621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410654.515234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410654.648822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410654.780852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410654.921744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410655.035097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410655.160992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410655.286707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410655.417950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410655.542066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410655.672194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410655.802206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410655.948644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410656.070404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410656.203188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410656.341113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410656.465528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410656.599979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410656.723612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410656.846779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410656.974818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410657.108351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410657.230980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410657.360962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410657.488619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410657.628312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410657.752892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410657.893963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410658.019086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410658.146149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410658.271967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410658.400618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410658.531635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410658.650009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410658.784622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410658.912588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410659.034141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410659.158008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410659.288860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410659.426703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410659.553075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410659.692978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410659.803124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410659.950413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410660.084189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410660.215837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410660.342116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410660.463637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410660.596092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410660.720295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410660.844059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410660.972219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410661.097512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410661.221008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410661.346803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410661.487595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410661.612524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410661.730709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410661.867157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410662.001625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410662.117898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410662.243229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410662.382865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410662.528849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410662.642823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410662.761894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410662.889689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410663.020482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410663.142066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410663.269994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410663.405970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410663.528690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410663.652934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410663.798197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410663.909526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410664.036444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410664.157321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410664.292462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410664.423335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410664.554579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410664.682806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410664.812652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410664.945319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410665.077862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410665.202792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410665.345896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410665.466051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410665.590291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410665.720851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410665.845813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410665.968007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410666.096982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410666.223972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410666.360955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410666.491867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410666.630557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410666.764978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410666.900851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410667.018551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410667.149150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410667.277652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410667.407822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410667.531900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410667.673794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410667.778521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410667.914264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410668.036072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410668.173635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410668.303729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410668.460789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410668.574175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410668.703197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410668.840610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410668.970856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410669.089597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410669.225919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410669.345334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410669.468443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410669.601230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410669.730278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410669.850878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410669.979894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410670.111851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410670.237743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410670.383210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410670.509643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410670.652565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410670.779327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410670.896158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410671.028808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410671.149197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410671.291670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410671.400971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410671.535779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410671.661353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410671.786738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410671.923103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410672.045358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410672.166801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410672.302540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410672.428046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410672.567823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410672.694479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410672.826458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410672.951646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410673.085106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410673.282672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410673.405803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410673.531248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410673.658098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410673.796577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410673.925115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410674.056534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410674.178258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410674.316317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410674.448368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410674.576334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410674.709080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410674.834452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410674.988156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410675.094960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410675.219869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410675.349875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410675.480000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410675.604939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410675.753752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410675.865090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410676.004912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410676.121334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410676.272438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410676.413181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410676.521933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410676.650188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410676.796496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410676.907664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410677.047763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410677.152737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410677.279697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410677.417006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410677.533819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410677.670772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410677.821017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410677.946207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410678.078759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410678.208121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410678.346215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410678.475130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410678.602611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410678.725484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410678.848549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410678.973739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410679.101758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410679.224355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410679.353327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410679.480130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410679.627777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410679.757483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410679.887358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410680.017296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410680.149095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410680.265495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410680.420154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410680.527277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410680.655204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410680.781544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410680.910975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410681.036252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410681.166745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410681.298079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410681.448048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410681.569164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410681.717265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410681.842124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410681.970502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410682.093593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410682.221858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410682.346973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410682.469662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410682.593906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410682.722907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410682.849487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410682.986235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410683.109584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410683.240170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410683.360664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410683.490794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410683.621580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410683.757770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410683.905821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410684.033119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410684.155138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410684.282109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410684.408023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410684.537185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410684.660119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410684.800963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410684.922965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410685.056043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410685.179745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410685.311147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410685.442972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410685.578322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410685.711012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410685.861263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410685.969085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410686.119401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410686.218939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410686.357496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410686.474143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410686.601363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410686.728061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410686.864302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410686.999644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410687.143198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410687.269166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410687.397234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410687.517427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410687.672737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410687.781061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410687.913780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410688.040602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410688.173590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410688.306231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410688.443774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410688.571166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410688.697145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410688.819496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410688.948946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410689.088482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410689.222205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410689.342285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410689.470708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410689.613316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410689.721099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410689.857808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410689.985602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410690.123244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410690.251250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410690.388332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410690.528115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410690.666532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410690.801795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410690.903726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410691.037487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410691.163124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410691.285651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410691.403078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410691.532571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410691.655146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410691.814010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410691.911498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410692.035625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410692.157922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410692.282859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410692.408607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410692.540234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410692.654634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410692.787452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410692.911075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410693.042581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410693.172702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410693.302562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410693.431298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410693.568297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410693.709722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410693.842632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410693.970294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410694.091580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410694.216758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410694.350583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410694.474946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410694.601335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410694.727187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410694.857602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410694.987605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410695.130573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410695.261990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410695.388046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410695.547023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410695.661003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410695.792718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410695.947610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410696.063100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410696.207910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410696.336123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410696.466478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410696.583515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410696.718380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410696.842103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410696.966513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410697.087017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410697.220933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410697.345741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410697.477617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410697.596778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410697.723295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410697.851373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410697.986308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410698.113531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410698.255908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410698.384223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410698.523472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410698.639473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410698.773597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410698.890542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410699.030924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410699.153343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410699.278459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410699.405751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410699.536153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410699.662779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410699.791497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410699.928395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410700.070243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410700.188518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410700.323189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410700.454906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410700.590982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410700.718656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410700.846534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410700.979925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410701.111554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410701.238153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410701.363805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410701.501037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410701.644661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410701.765832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410701.902297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410702.026345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410702.158540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410702.280184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410702.412148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410702.536843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410702.666505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410702.797968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410702.945340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410703.050532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410703.182868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410703.329180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410703.455873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410703.581078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410703.715914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410703.836823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410703.960975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410704.082701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410704.215458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410704.342217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410704.468732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410704.594535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410704.715235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410704.840521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410704.971847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410705.095731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410705.224247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410705.366993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410705.487759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410705.626798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410705.743575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410705.900077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410706.023784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410706.150818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410706.273207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410706.395735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410706.531833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410706.655333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410706.773278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410706.904161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410707.030212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410707.157633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410707.282983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410707.409092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410707.548621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410707.663878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410707.803925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410707.923202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410708.068388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410708.182720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410708.322272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410708.449009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410708.571820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410708.708558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410708.845130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410708.971870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410709.092903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410709.216127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410709.339140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410709.472605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410709.591866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410709.713219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410709.845903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410709.968368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410710.091162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410710.227158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410710.347300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410710.479526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410710.599353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410710.724823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410710.854225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410710.981888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410711.112000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410711.237476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410711.367064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410711.504065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410711.624585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410711.772850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410711.901685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410712.024871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410712.158360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410712.279808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410712.408035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410712.539213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410712.688495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410712.801320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410712.928609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410713.070608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410713.202059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410713.364250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410713.491994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410713.614879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410713.739373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410713.883361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410714.033549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410714.149224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410714.280892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410714.416680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410714.528410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410714.656280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410714.798057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410714.905829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410715.029877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410715.172168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410715.301496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410715.433777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410715.569479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410715.692687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410715.817810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410715.957415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410716.083682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410716.213207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410716.345151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410716.454546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410716.588642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410716.705919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410716.840701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410716.973098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410717.100191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410717.222783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410717.351959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410717.474917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410717.617062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410717.736404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410717.873319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410718.004648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410718.146107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410718.269843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410718.418211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410718.522336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410718.648674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410718.795835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410718.908197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410719.026016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410719.158470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410719.283813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410719.408501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410719.533015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410719.656770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410719.785202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410719.936517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410720.059398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410720.198529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410720.326692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410720.455757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410720.577172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410720.708616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410720.836983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410720.965703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410721.093737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410721.222747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410721.350254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410721.482879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410721.603556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410721.746441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410721.879554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410722.008938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410722.142798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410722.277266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410722.392464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410722.527685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410722.646445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410722.778340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410722.901095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410723.031242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410723.153662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410723.282584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410723.402118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410723.530271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410723.647294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410723.783913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410723.907667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410724.037903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410724.160925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410724.300631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410724.412846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410724.545070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410724.674622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410724.803430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410724.958112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410725.089006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410725.206667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410725.348991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410725.465968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410725.594236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410725.716690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410725.857127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410725.974466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410726.118593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410726.235230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410726.379704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410726.510082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410726.659732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410726.770521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410726.921272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410727.028428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410727.156405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410727.283630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410727.411504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410727.529873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410727.661819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410727.798702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410727.922970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410728.041262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410728.174679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410728.293800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410728.438830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410728.557550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410728.694468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410728.821565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410728.963891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410729.081281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410729.210738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410729.335862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410729.465282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410729.610115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410729.719853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410729.842167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410729.967293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410730.098396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410730.227053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410730.345848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410730.470543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410730.595229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410730.725215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410730.845959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410730.995897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410731.117100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410731.255193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410731.380574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410731.513931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410731.640265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410731.778926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410731.903683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410732.032001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410732.162165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410732.305346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410732.431598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410732.592282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410732.889799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410733.232810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410733.530524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410733.765480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410733.967093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410734.152019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410734.339545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410734.508812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410734.653021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410734.834776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410734.981181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410735.155393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410735.363467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410735.486294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410735.651712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410735.873920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410736.046135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410736.194977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410736.358834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410736.608772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410736.742736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410736.884157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410737.061373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410737.219469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410737.403427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410737.544800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410737.706832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410737.896530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410738.049593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410738.224197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410738.410738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410738.554832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410738.811100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410738.976219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410739.103909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410739.235088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410739.359420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410739.483819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410739.633031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410739.770091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410739.903393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410740.034430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410740.154250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410740.284519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410740.406452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410740.531157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410740.654788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410740.783647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410740.919522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410741.045260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410741.200316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410741.308924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410741.443658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410741.586335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410741.756766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410741.978175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410742.106747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410742.231665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410742.352038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410742.477129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410742.601297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410742.730677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410742.850740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410742.982544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410743.108651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410743.241038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410743.363754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410743.497130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410743.636890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410743.768533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410743.893775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410744.032911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410744.153420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410744.274727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410744.402710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410744.528981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410744.650051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410744.782878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410744.903229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410745.030747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410745.152677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410745.278754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410745.400634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410745.530760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410745.642033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410745.777210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410745.896583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410746.028527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410746.160758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410746.277716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410746.401678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410746.527891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410746.644203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410746.782072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410746.909112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410747.049245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410747.177584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410747.313968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410747.434802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410747.583645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410747.728305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410747.832678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410747.951423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410748.078929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410748.206409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410748.358328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410748.458997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410748.589556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410748.712478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410748.842066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410748.964131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410749.092436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410749.217883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410749.355618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410749.470356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410749.598947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410749.724226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410749.856930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410749.986785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410750.130609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410750.276230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410750.394327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410750.514048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410750.650959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410750.771252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410750.901869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410751.021843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410751.157727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410751.273921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410751.408372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410751.528655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410751.655915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410751.778499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410751.911741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410752.033828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410752.162890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410752.282794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410752.415385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410752.539718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410752.666500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410752.792660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410752.918994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410753.068086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410753.188019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410753.321144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410753.456987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410753.579030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410753.696385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410753.835276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410753.982028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410754.088476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410754.216794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410754.339824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410754.472020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410754.589570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410754.719097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410754.856453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410754.971919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410755.099246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410755.228253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410755.347386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410755.482463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410755.611353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410755.767455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410755.897333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410756.026073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410756.150732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410756.280421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410756.400353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410756.537547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410756.659152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410756.784831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410756.908888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410757.032772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410757.154871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410757.280822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410757.403580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410757.534755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410757.658182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410757.784252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410757.909992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410758.038835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410758.163640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410758.305736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410758.435362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410758.568659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410758.709347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410758.846535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410758.959702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410759.084886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410759.211241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410759.343282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410759.462598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410759.594082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410759.733491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410759.848871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410759.985478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410760.115319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410760.250506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410760.383432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410760.517116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410760.653193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410760.796321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410760.902510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410761.020233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410761.158413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410761.280233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410761.405965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410761.528865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410761.654198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410761.787145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410761.919324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410762.033751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410762.159478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410762.285570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410762.426400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410762.536584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410762.667022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410762.795219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410762.920059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410763.045593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410763.177001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410763.299194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410763.457690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410763.591848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410763.718989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410763.844279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410763.987599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410764.106614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410764.235540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410764.371591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410764.503381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410764.629084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410764.753841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410764.888046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410765.025754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410765.151049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410765.281252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410765.400990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410765.547143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410765.657013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410765.782341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410765.905936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410766.043248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410766.160409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410766.288687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410766.426531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410766.562426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410766.686273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410766.838819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410766.964225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410767.091038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410767.209568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410767.337869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410767.458573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410767.590300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410767.713629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410767.842505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410767.967085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410768.094442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410768.223396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410768.349457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410768.475701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410768.608897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410768.735430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410768.875461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410769.002853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410769.167779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410769.275207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410769.400147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410769.531134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410769.660342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410769.783484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410769.917775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410770.038874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410770.167356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410770.299170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410770.431306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410770.565266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410770.696166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410770.820080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410770.967482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410771.086473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410771.217200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410771.336965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410771.471057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410771.586260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410771.740647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410771.863474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410772.001215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410772.128355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410772.273179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410772.392239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410772.515765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410772.643686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410772.770140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410772.892231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410773.023830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410773.148954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410773.271417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410773.403707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410773.527181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410773.648223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410773.775903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410773.907410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410774.037920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410774.158738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410774.290829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410774.412768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410774.554311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410774.674266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410774.806324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410774.927111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410775.067945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410775.190051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410775.329993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410775.453503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410775.586577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410775.708356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410775.846971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410775.956814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410776.096323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410776.217991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410776.358546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410776.491477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410776.622811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410776.756115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410776.911378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410777.013350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410777.146655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410777.275563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410777.400821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410777.529361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410777.653864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410777.791824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410777.921533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410778.031999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410778.168526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410778.283789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410778.404723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410778.530797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410778.674157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410778.784327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410778.912742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410779.036935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410779.166584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410779.294404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410779.425802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410779.546432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410779.705640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410779.823703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410779.951793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410780.072941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410780.207809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410780.332658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410780.465521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410780.586014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410780.717857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410780.844322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410780.980916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410781.108212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410781.234710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410781.363954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410781.504525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410781.631397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410781.776500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410781.909523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410782.036600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410782.154898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410782.280878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410782.405001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410782.531553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410782.659308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410782.793571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410782.928586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410783.052910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410783.203750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410783.310585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410783.442302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410783.569893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410783.696342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410783.839567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410783.964071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410784.097306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410784.219882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410784.351576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410784.495322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410784.608760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410784.754697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410784.885047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410785.008327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410785.134641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410785.262707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410785.395868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410785.516961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410785.641412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410785.759891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410785.896443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410786.023505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410786.168057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410786.281352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410786.414895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410786.534985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410786.671896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410786.790886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410786.928081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410787.049559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410787.193046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410787.303684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410787.435571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410787.566500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410787.701819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410787.822215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410787.953544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410788.083305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410788.208837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410788.326015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410788.466266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410788.589358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410788.716106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410788.846854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410788.964893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410789.086557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410789.213623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410789.342524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410789.471431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410789.606138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410789.721806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410789.843488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410789.975103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410790.113874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410790.229721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410790.365295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410790.508998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410790.641231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410790.763306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410790.895562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410791.034347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410791.149274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410791.283514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410791.410416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410791.525234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410791.653261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410791.797564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410791.928817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410792.039362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410792.159847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410792.283408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410792.404243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410792.538274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410792.661716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410792.806061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410792.920153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410793.065028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410793.190768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410793.331011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410793.450186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410793.591172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410793.711377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410793.840807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410793.965558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410794.097962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410794.219918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410794.349361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410794.482917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410794.598710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410794.721708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410794.846592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410794.972733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410795.106873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410795.231592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410795.365411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410795.486809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410795.627708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410795.762743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410795.892113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410796.015490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410796.142032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410796.270680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410796.416414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410796.527272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410796.655042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410796.780172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410796.920218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410797.027500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410797.166286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410797.283206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410797.438536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410797.539142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410797.661116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410797.795234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410797.963584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410798.082713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410798.215436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410798.329962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410798.463438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410798.589316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410798.733839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410798.845969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410798.996258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410799.109936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410799.223264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410799.356450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410799.488574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410799.624049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410799.772948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410799.899895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410800.042576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410800.146307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410800.273962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410800.402916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410800.527665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410800.649701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410800.786080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410800.904249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410801.033878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410801.175563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410801.291816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410801.427191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410801.563665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410801.708473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410801.853266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410801.981486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410802.109783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410802.239841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410802.365968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410802.506682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410802.631173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410802.773869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410802.906523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410803.027583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410803.171668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410803.282416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410803.432897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410803.534152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410803.670850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410803.832762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410803.963242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410804.086596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410804.225733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410804.342387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410804.473157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410804.597579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410804.736366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410804.859870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410804.988905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410805.132334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410805.256314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410805.391016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410805.520962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410805.652505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410805.778973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410805.905566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410806.028711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410806.170153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410806.296188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410806.409506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410806.534407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410806.656396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410806.782500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410806.908412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410807.043875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410807.179197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410807.329291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410807.442684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410807.569206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410807.705284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410807.835996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410807.956829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410808.086169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410808.206143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410808.343024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410808.463765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410808.598855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410808.730341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410808.859928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410809.001140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410809.136467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410809.264555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410809.405642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410809.539157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410809.657999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410809.771917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410809.901332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410810.028601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410810.155134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410810.280065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410810.411086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410810.530632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410810.667201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410810.795043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410810.932909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410811.055864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410811.206999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410811.327306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410811.455317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410811.576972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410811.711055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410811.833212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410811.974773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410812.088775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410812.223093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410812.341946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410812.471238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410812.605686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410812.716531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410812.842893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410812.964390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410813.092517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410813.221899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410813.354006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410813.482912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410813.602466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410813.746006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410813.877888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410814.016108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410814.148987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410814.282781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410814.395358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410814.527650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410814.649891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410814.775270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410814.908914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410815.025110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410815.153331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410815.294644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410815.404948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410815.529364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410815.673368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410815.819457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410815.935248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410816.069032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410816.199778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410816.330857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410816.463943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410816.587480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410816.715629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410816.854227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410816.984976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410817.099482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410817.231817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410817.377669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410817.501364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410817.656859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410817.777228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410817.892598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410818.018817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410818.147153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410818.271643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410818.399680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410818.542426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410818.660396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410818.783241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410818.908922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410819.037663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410819.167319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410819.293518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410819.444152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410819.567204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410819.697687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410819.814838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410819.940524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410820.080884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410820.212728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410820.334997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410820.459503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410820.588279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410820.720520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410820.855702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410820.977829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410821.106627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410821.237210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410821.368310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410821.502867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410821.644484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410821.766030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410821.902676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410822.020288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410822.146152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410822.267390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410822.403039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410822.530043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410822.665952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410822.778131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410822.898028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410823.025333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410823.152785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410823.278269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410823.401706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410823.531233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410823.658871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410823.794825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410823.919390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410824.064872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410824.188807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410824.333628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410824.458376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410824.579039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410824.710410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410824.832263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410824.960299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410825.092284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410825.207289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410825.347235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410825.462880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410825.593414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410825.725545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410825.850376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410825.977801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410826.110084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410826.249127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410826.393315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410826.516312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410826.649634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410826.765975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410826.893112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410827.023304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410827.156823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410827.282038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410827.401467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410827.526906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410827.659974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410827.777995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410827.892550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410828.021558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410828.149606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410828.277493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410828.403352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410828.522908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410828.652510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410828.777961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410828.901985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410829.032151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410829.160342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410829.273357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410829.401920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410829.527005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410829.667517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410829.776400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410829.908620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410830.042995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410830.159935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410830.279031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410830.409875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410830.533129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410830.660021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410830.794388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410830.926035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410831.050774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410831.191199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410831.323406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410831.446913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410831.581783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410831.714418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410831.858610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410831.979466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410832.120757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410832.239788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410832.376552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410832.495987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410832.628300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410832.769158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410832.895527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410833.023322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410833.150575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410833.278440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410833.398914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410833.533875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410833.653297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410833.777300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410833.907967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410834.041950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410834.160825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410834.292876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410834.438925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410834.552328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410834.681764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410834.820124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410834.942926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410835.087498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410835.203257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410835.334565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410835.463805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410835.587865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410835.711908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410835.839522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410835.969579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410836.096133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410836.224668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410836.360087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410836.488460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410836.639025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410836.754704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410836.880336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410837.019707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410837.157840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410837.286789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410837.398845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410837.530479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410837.668862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410837.796466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410837.935260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410838.049608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410838.196029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410838.302773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410838.439435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410838.569301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410838.700112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410838.826209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410838.953453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410839.073454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410839.214252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410839.335617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410839.471946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410839.591885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410839.722210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410839.853929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410839.995934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410840.130646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410840.258083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410840.390938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410840.527748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410840.662302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410840.779612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410840.902521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410841.026650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410841.150893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410841.276920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410841.405718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410841.543696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410841.653710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410841.777893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410841.907862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410842.053490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410842.159364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410842.286567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410842.419503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410842.581180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410842.703435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410842.832848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410842.964024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410843.093825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410843.207714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410843.335197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410843.459346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410843.586177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410843.705359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410843.835072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410843.960066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410844.085551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410844.212841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410844.342392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410844.478096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410844.591335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410844.717338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410844.848850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410844.977089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410845.139522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410845.270859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410845.382671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410845.516881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410845.646573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410845.761640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410845.905902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410846.024143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410846.149046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410846.272498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410846.398213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410846.526906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410846.662534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410846.777824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410846.906223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410847.031349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410847.156337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410847.273456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410847.398890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410847.522609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410847.660414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410847.778448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410847.902791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410848.035641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410848.165290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410848.281600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410848.412106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410848.542893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410848.667486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410848.793494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410848.928464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410849.063822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410849.192764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410849.329355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410849.463264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410849.585878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410849.717279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410849.841928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410849.968928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410850.095282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410850.223028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410850.351578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410850.503885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410850.630002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410850.768411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410850.889211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410851.019931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410851.149846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410851.280682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410851.394805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410851.525072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410851.639073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410851.768427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410851.896837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410852.034326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410852.169519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410852.271219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410852.404245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410852.532280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410852.657197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410852.783573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410852.905938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410853.047032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410853.175020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410853.354198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410853.603283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410853.897239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410854.107949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410854.452562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410854.649950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410854.784860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410855.005772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410855.131043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410855.314855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410855.471366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410855.687140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410855.834604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410856.032128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410856.212169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410856.353414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410856.516032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410856.740917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410856.897110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410857.087914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410857.242371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410857.483478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410857.659890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410857.779974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410857.925837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410858.109851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410858.290655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410858.431731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410858.612757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410858.784243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410858.984295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410859.143257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410859.309652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410859.487884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410859.700992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410859.906692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410860.044065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410860.171322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410860.292502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410860.423869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410860.557510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410860.708022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410860.841323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410860.964239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410861.110775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410861.227783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410861.344214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410861.469610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410861.605117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410861.761918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410861.897416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410862.041722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410862.148399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410862.288131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410862.399657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410862.525673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410862.659482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410862.858073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410863.028884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410863.162995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410863.276018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410863.395204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410863.533663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410863.642147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410863.780039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410863.920997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410864.035896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410864.158965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410864.293094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410864.423879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410864.554657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410864.694288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410864.822215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410864.943189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410865.067627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410865.201499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410865.331852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410865.453261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410865.578359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410865.706541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410865.829514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410865.951926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410866.089422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410866.212809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410866.340861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410866.465315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410866.588377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410866.712514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410866.835180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410866.976611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410867.089209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410867.214658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410867.334098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410867.450662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410867.588414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410867.713771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410867.854628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410868.000266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410868.138232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410868.278763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410868.411144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410868.533213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410868.657925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410868.792633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410868.911450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410869.039683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410869.181842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410869.320159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410869.454787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410869.573685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410869.707386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410869.832650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410869.961949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410870.083133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410870.209266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410870.336999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410870.460585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410870.585268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410870.709929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410870.829007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410870.959591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410871.090703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410871.232203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410871.336986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410871.478940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410871.590991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410871.727648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410871.846992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410871.999472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410872.104844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410872.237436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410872.363537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410872.504572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410872.637884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410872.769754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410872.885510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410873.017483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410873.146677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410873.290570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410873.397708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410873.527096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410873.651950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410873.773854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410873.906802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410874.038897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410874.166066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410874.292361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410874.414275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410874.550561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410874.690219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410874.814985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410874.938633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410875.096323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410875.201019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410875.343610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410875.452926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410875.585869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410875.716673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410875.857325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410875.978561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410876.105639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410876.232380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410876.406233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410876.506707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410876.644563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410876.763306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410876.892864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410877.015694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410877.144887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410877.263122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410877.391135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410877.517575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410877.642710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410877.775532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410877.901609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410878.022058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410878.151010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410878.278652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410878.401954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410878.534303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410878.652278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410878.776416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410878.903545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410879.026524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410879.151478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410879.275337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410879.408470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410879.536215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410879.668271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410879.799604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410879.934546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410880.066269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410880.208227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410880.325717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410880.462678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410880.588312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410880.704813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410880.829556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410880.961031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410881.086254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410881.213884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410881.330292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410881.462246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410881.581697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410881.706432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410881.835739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410881.958171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410882.099040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410882.232944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410882.340519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410882.458326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410882.604534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410882.719021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410882.839631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410882.964316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410883.091451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410883.219493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410883.336548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410883.462952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410883.589901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410883.718075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410883.841694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410883.967684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410884.093466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410884.230144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410884.371136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410884.502427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410884.632048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410884.754780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410884.885911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410885.020298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410885.149939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410885.293862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410885.398362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410885.532068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410885.649948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410885.776226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410885.909789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410886.029256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410886.208748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410886.391073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410886.570473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410886.709552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410886.826036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410886.956930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410887.078961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410887.204027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410887.324498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410887.457588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410887.581801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410887.716801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410887.835987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410887.965274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410888.089682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410888.216715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410888.336966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410888.468179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410888.597683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410888.722121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410888.852774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410888.975881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410889.108014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410889.267484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410889.384547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410889.507781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410889.639287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410889.767469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410889.882635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410890.016807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410890.144196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410890.289304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410890.412044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410890.533362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410890.643545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410890.773660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410890.911199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410891.046547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410891.152324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410891.307945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410891.413773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410891.549652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410891.690404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410891.837908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410891.959214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410892.088023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410892.217747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410892.341018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410892.463506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410892.594239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410892.722042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410892.851715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410892.972690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410893.112070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410893.232004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410893.365008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410893.501957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410893.631854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410893.765061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410893.898460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410894.021514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410894.156666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410894.277284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410894.404999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410894.527797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410894.664322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410894.782259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410894.909939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410895.041322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410895.164664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410895.298122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410895.425749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410895.552132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410895.699914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410895.818720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410895.954823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410896.072206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410896.207987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410896.339289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410896.468157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410896.582767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410896.713055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410896.828970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410896.960043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410897.081681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410897.215672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410897.338058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410897.462024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410897.587507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410897.714733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410897.840190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410897.966175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410898.094655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410898.218177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410898.347098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410898.480952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410898.611899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410898.747090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410898.884866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410899.003057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410899.140727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410899.272338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410899.399717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410899.522954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410899.651515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410899.773738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410899.899639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410900.029233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410900.166905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410900.281257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410900.405598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410900.532280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410900.664570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410900.794879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410900.917779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410901.057220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410901.211109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410901.339918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410901.463459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410901.597911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410901.703041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410901.846676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410901.960452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410902.088382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410902.221084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410902.343649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410902.475994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410902.594391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410902.725594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410902.849227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410902.987954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410903.134990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410903.247748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410903.390558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410903.512376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410903.637610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410903.769197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410903.898626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410904.021800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410904.151001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410904.273848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410904.392183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410904.527296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410904.665930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410904.775043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410904.907583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410905.029144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410905.155756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410905.281456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410905.412464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410905.541168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410905.664540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410905.793494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410905.945484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410906.068030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410906.189530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410906.320577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410906.453443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410906.582808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410906.701475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410906.824664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410906.957707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410907.083770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410907.206913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410907.349955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410907.452260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410907.588203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410907.707773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410907.834748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410907.952766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410908.075859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410908.209845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410908.332152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410908.459778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410908.581651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410908.709903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410908.832839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410908.960553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410909.081119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410909.214277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410909.333503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410909.466123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410909.584975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410909.714626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410909.837969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410909.979709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410910.093797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410910.220279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410910.353962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410910.486837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410910.613141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410910.754017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410910.886952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410911.026460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410911.141762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410911.272376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410911.396124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410911.524585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410911.658667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410911.779117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410911.904522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410912.034046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410912.163659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410912.301821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410912.418567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410912.564953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410912.687221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410912.815485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410912.947627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410913.081452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410913.219547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410913.339148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410913.463395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410913.586835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410913.728463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410913.840282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410913.956906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410914.089230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410914.224818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410914.338440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410914.463957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410914.589187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410914.727609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410914.835780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410914.959229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410915.098019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410915.212058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410915.337003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410915.479396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410915.598210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410915.714497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410915.841201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410915.965835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410916.093634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410916.211308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410916.345683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410916.459513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410916.592674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410916.718362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410916.846928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410916.968795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410917.101846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410917.222868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410917.351690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410917.482741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410917.621443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410917.734428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410917.900239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410918.028554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410918.145617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410918.289073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410918.416029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410918.518003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410918.650371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410918.763151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410918.902069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410919.013321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410919.149036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410919.268593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410919.399527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410919.525760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410919.648743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410919.781193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410919.940584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410920.057714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410920.176478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410920.312710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410920.447962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410920.575870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410920.706650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410920.830828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410920.960887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410921.094140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410921.216003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410921.341226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410921.468117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410921.604118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410921.743696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410921.880983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410922.016647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410922.145080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410922.272193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410922.394716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410922.526225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410922.637647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410922.770005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410922.891951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410923.024613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410923.147747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410923.269831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410923.397711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410923.523828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410923.641529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410923.775621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410923.899329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410924.026479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410924.151365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410924.299394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410924.419747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410924.545553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410924.679659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410924.818033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410924.957896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410925.083232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410925.204957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410925.332039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410925.470871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410925.580871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410925.708580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410925.828762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410925.950528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410926.087567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410926.229150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410926.336628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410926.457170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410926.585626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410926.716515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410926.839375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410926.962522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410927.088239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410927.217855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410927.340316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410927.467660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410927.595131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410927.733495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410927.878662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410928.013006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410928.144533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410928.270845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410928.404904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410928.531939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410928.651516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410928.779413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410928.908405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410929.033318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410929.157831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410929.306546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410929.416314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410929.542130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410929.694283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410929.811385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410929.950194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410930.070916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410930.205959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410930.353367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410930.476552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410930.590314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410930.718774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410930.841777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410930.968544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410931.117752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410931.251595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410931.374226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410931.501735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410931.636387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410931.754535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410931.879752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410932.017953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410932.144562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410932.259873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410932.384124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410932.515922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410932.640685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410932.767315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410932.896354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410933.025310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410933.154613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410933.277268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410933.406255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410933.559818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410933.671234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410933.810629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410933.943848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410934.072135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410934.196075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410934.336584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410934.461638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410934.587366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410934.704169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410934.838004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410934.958924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410935.100267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410935.204621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410935.337112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410935.473888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410935.590484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410935.719386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410935.867468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410935.993118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410936.128527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410936.266119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410936.398259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410936.516632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410936.652501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410936.783488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410936.892292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410937.032097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410937.151786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410937.274195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410937.418771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410937.536192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410937.653979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410937.773816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410937.897727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410938.026515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410938.154452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410938.281554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410938.405877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410938.533809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410938.685347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410938.788825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410938.912636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410939.057449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410939.190418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410939.312539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410939.439401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410939.582277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410939.708208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410939.835000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410939.960672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410940.088367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410940.217291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410940.341134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410940.470591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410940.591050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410940.722226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410940.846037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410940.979233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410941.110535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410941.239008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410941.376728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410941.511948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410941.650036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410941.775994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410941.915533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410942.023559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410942.151947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410942.286332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410942.405551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410942.543562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410942.678012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410942.811540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410942.945004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410943.069134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410943.194536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410943.328563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410943.449755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410943.571568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410943.696513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410943.826360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410943.944167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410944.076034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410944.196110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410944.325962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410944.458655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410944.576827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410944.706710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410944.827359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410944.958341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410945.086408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410945.203450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410945.330475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410945.454492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410945.586223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410945.720201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410945.833473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410945.957267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410946.084480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410946.206537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410946.336231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410946.461030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410946.586592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410946.707988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410946.836764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410946.959941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410947.082938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410947.212029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410947.336502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410947.459558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410947.603212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410947.709872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410947.836318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410947.963063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410948.092440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410948.215288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410948.344924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410948.468778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410948.600421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410948.733595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410948.881626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410949.002453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410949.125346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410949.252826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410949.374675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410949.508794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410949.642281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410949.773807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410949.900568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410950.027382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410950.152864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410950.277263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410950.404431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410950.536643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410950.663356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410950.795828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410950.933901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410951.063684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410951.206141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410951.344399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410951.464047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410951.579975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410951.715990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410951.865846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410951.995875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410952.130082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410952.262571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410952.388771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410952.517052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410952.646089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410952.770699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410952.894497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410953.022392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410953.143513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410953.274737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410953.393200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410953.524884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410953.646823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410953.772237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410953.895079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410954.039580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410954.153835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410954.287462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410954.414960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410954.553227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410954.687340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410954.816945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410954.952703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410955.081153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410955.196018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410955.337096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410955.450252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410955.576696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410955.704297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410955.835499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410955.957780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410956.081731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410956.199122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410956.334722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410956.457900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410956.583133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410956.710277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410956.846109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410956.953723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410957.088683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410957.210905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410957.331959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410957.459598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410957.588964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410957.712236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410957.840394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410957.970550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410958.132573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410958.263489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410958.378025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410958.502167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410958.636156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410958.756828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410958.882760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410959.019790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410959.151683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410959.270341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410959.400247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410959.519209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410959.646312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410959.770474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410959.921239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410960.033014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410960.152795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410960.273866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410960.405527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410960.540053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410960.717116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410960.904565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410961.062926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410961.247832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410961.467722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410961.707956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410961.840570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410961.972101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410962.099665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410962.232908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410962.358841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410962.497367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410962.634655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410962.756182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410962.883749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410963.011713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410963.147028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410963.275096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410963.404175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410963.524339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410963.650066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410963.786713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410963.918975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410964.043765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410964.172787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410964.327533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410964.447563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410964.571793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410964.697942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410964.828728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410964.954018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410965.079447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410965.207027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410965.335532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410965.463145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410965.608418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410965.732666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410965.891410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410966.009845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410966.146739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410966.267469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410966.398743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410966.527010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410966.656362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410966.782653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410966.907725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410967.036271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410967.177289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410967.307927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410967.437932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410967.567006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410967.702715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410967.834398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410967.956846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410968.082423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410968.210512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410968.336705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410968.471359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410968.586153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410968.721073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410968.840572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410968.971838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410969.102095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410969.236376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410969.374116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410969.521742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410969.662755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410969.771766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410969.899720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410970.024532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410970.148260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410970.278750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410970.407465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410970.538200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410970.669958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410970.809226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410970.943085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410971.084277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410971.204116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410971.337959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410971.464731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410971.592325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410971.716373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410971.853508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410971.994832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410972.136459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410972.269278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410972.401699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410972.534215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410972.668615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410972.794039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410972.930999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410973.078583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410973.205605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410973.331370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410973.455777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410973.575143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410973.759893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410974.044755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410974.413522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410974.643858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410974.890975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410975.094163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410975.341331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410975.476859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410975.701254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410975.848434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410976.021063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410976.188652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410976.348079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410976.524724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410976.688511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410976.872625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410977.067252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410977.260857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410977.405281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410977.578921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410977.725014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410978.006799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410978.154413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410978.288398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410978.474262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410978.600012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410978.804679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410978.954471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410979.121625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410979.342228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410979.517934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410979.670811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410979.867437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410980.081850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410980.243696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410980.473878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410980.595895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410980.725946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410980.852321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410980.981282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410981.110581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410981.262866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410981.388332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410981.525110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410981.648105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410981.803975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410981.931174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410982.051303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410982.184741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410982.330869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410982.446781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410982.587664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410982.712312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410982.852802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410982.962774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410983.099392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410983.219640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410983.477296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410983.605098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410983.757046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410983.897517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410984.033694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410984.139385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410984.281164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410984.396224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410984.520758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410984.652236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410984.776423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410984.899315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410985.029577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410985.155020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410985.280770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410985.412227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410985.540065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410985.669048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410985.806171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410985.918843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410986.072126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410986.192363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410986.320572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410986.456368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410986.583394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410986.691750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410986.827261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410986.951699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410987.082948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410987.206588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410987.333205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410987.469562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410987.582475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410987.717558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410987.866811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410987.984425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410988.103742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410988.250259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410988.387819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410988.515167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410988.652234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410988.794827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410988.915654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410989.053964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410989.182808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410989.317479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410989.450490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410989.574592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410989.721657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410989.835751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410989.952948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410990.079065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410990.225723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410990.337602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410990.464699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410990.584713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410990.712488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410990.836239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410990.965834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410991.090596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410991.216987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410991.354163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410991.472636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410991.596928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410991.742020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410991.876449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410992.001136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410992.142452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410992.268050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410992.390212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410992.517468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410992.634790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410992.769465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410992.889306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410993.014711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410993.139540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410993.269578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410993.391418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410993.519691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410993.635405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410993.767874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410993.897692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410994.021077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410994.148552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410994.283123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410994.399554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410994.523339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410994.654650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410994.774630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410994.898586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410995.036603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410995.162620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410995.288938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410995.422391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410995.561224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410995.704734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410995.833549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410995.958709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410996.086112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410996.213264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410996.339828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410996.462233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410996.601507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410996.725194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410996.851292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410996.975471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410997.105428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410997.239154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410997.388496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410997.497817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410997.635564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410997.749126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410997.895199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410998.012536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638410998.157985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410998.267041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410998.402672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410998.533077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410998.685093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410998.810168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410998.947701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410999.059994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410999.192614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410999.311229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410999.454244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410999.570192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410999.695539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410999.820180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638410999.957689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411000.083353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411000.212175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411000.334769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411000.463023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411000.585151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411000.717487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411000.852351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411000.967618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411001.092694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411001.241069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411001.350064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411001.492679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411001.624417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411001.756433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411001.886507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411002.019639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411002.149304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411002.289269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411002.413812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411002.561520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411002.681663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411002.825305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411002.939574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411003.079239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411003.190104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411003.321146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411003.454060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411003.584371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411003.726851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411003.850791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411003.962101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411004.092643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411004.227079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411004.358097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411004.487867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411004.616842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411004.746372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411004.876435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411005.004244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411005.142135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411005.277088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411005.399970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411005.524611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411005.662226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411005.779969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411005.915691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411006.040833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411006.168633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411006.306435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411006.453454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411006.581549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411006.698623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411006.827011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411006.956290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411007.077068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411007.212991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411007.332228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411007.475646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411007.585717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411007.721446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411007.847908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411007.977507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411008.106960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411008.253008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411008.384218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411008.517864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411008.642881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411008.771365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411008.898164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411009.037060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411009.152843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411009.281214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411009.416426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411009.540779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411009.668910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411009.818083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411009.954536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411010.067408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411010.193810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411010.334251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411010.458676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411010.586730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411010.707764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411010.831228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411010.956914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411011.085588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411011.208937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411011.329702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411011.454966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411011.581464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411011.723637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411011.850705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411011.974501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411012.108220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411012.228029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411012.365943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411012.507042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411012.626587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411012.765455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411012.892106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411013.012007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411013.142045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411013.266478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411013.404542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411013.513314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411013.647506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411013.762921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411013.912672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411014.024350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411014.154444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411014.277511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411014.411776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411014.541116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411014.683069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411014.821371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411014.957169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411015.078218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411015.205622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411015.324207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411015.458047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411015.596597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411015.713686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411015.833738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411015.960975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411016.083251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411016.207892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411016.334017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411016.459363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411016.601558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411016.714636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411016.836504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411016.975426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411017.083991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411017.228789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411017.333519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411017.487940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411017.584545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411017.716275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411017.850465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411017.999547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411018.118277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411018.254733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411018.385099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411018.520020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411018.632421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411018.763479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411018.893208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411019.015376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411019.146510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411019.273659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411019.397141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411019.521616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411019.645614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411019.774854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411019.906969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411020.031800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411020.161811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411020.290619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411020.426039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411020.556827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411020.686007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411020.817976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411020.979297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411021.144285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411021.276824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411021.416766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411021.538887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411021.688516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411021.808585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411021.934425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411022.060939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411022.201518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411022.324522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411022.459121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411022.587485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411022.722696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411022.846509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411022.971818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411023.097314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411023.249237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411023.393014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411023.510009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411023.634149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411023.769058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411023.892305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411024.014387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411024.139282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411024.270137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411024.404914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411024.529620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411024.661353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411024.766644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411024.898448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411025.024517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411025.144503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411025.276549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411025.403685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411025.530626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411025.662370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411025.799569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411025.932489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411026.070806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411026.197831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411026.346825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411026.456604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411026.570059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411026.704737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411026.853941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411026.968824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411027.098855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411027.218819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411027.373190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411027.482265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411027.604369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411027.733063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411027.883276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411028.007116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411028.141481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411028.268553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411028.401335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411028.518331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411028.652114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411028.776698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411028.897220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411029.022964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411029.164671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411029.290422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411029.441679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411029.558561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411029.678374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411029.828046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411029.952957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411030.098088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411030.211716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411030.332576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411030.460844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411030.587521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411030.721515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411030.857748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411030.978572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411031.098243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411031.237753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411031.366529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411031.507095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411031.632529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411031.776731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411031.897480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411032.029210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411032.147193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411032.278786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411032.405853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411032.543495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411032.659346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411032.791164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411032.926543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411033.066784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411033.197478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411033.335349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411033.455477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411033.585893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411033.714160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411033.839309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411033.986083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411034.100416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411034.230004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411034.372685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411034.507765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411034.624496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411034.766649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411034.885674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411035.012295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411035.140473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411035.278285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411035.413848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411035.519827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411035.649231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411035.779807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411035.911904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411036.037128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411036.184652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411036.289920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411036.433952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411036.566736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411036.701704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411036.827279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411036.966329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411037.072886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411037.208957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411037.336384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411037.458366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411037.587327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411037.729917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411037.848158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411037.971446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411038.117718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411038.237067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411038.370897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411038.505544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411038.630726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411038.768676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411038.883635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411039.020597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411039.140739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411039.263820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411039.390890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411039.525347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411039.639471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411039.786298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411039.927815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411040.063634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411040.188757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411040.326978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411040.458720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411040.583113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411040.709469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411040.834541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411040.953830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411041.082657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411041.211308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411041.331073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411041.448977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411041.585831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411041.724327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411041.878755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411042.001935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411042.128589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411042.260362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411042.391639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411042.510736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411042.649834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411042.777762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411042.896176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411043.020667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411043.153103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411043.273088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411043.400545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411043.529997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411043.658820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411043.784912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411043.936237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411044.059194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411044.197567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411044.321533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411044.450367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411044.569567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411044.701694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411044.827408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411044.955346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411045.079562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411045.207502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411045.326817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411045.473414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411045.580722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411045.717421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411045.832929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411045.965659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411046.095628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411046.229068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411046.363655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411046.493791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411046.621650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411046.760320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411046.908332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411047.030654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411047.141603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411047.274709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411047.395406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411047.525486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411047.651696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411047.787889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411047.913492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411048.044519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411048.184673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411048.321090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411048.443917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411048.579949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411048.712355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411048.836208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411048.962317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411049.112532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411049.228985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411049.366797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411049.505670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411049.644874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411049.767074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411049.908663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411050.025322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411050.157893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411050.282594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411050.415186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411050.535555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411050.682623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411050.810600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411050.933969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411051.066813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411051.200633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411051.330559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411051.460208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411051.583165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411051.721182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411051.846047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411051.976104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411052.102564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411052.255701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411052.377542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411052.521292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411052.632486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411052.768606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411052.895641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411053.019674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411053.159533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411053.285967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411053.395651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411053.536161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411053.651024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411053.802361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411053.918744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411054.077016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411054.203918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411054.334237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411054.457481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411054.581816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411054.708111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411054.838608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411054.978412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411055.091198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411055.222941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411055.350651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411055.472962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411055.620712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411055.770160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411055.905191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411056.024426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411056.155878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411056.286248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411056.413898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411056.545686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411056.672408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411056.810208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411056.933925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411057.075285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411057.210059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411057.327464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411057.452488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411057.586949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411057.721531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411057.838862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411057.973860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411058.099388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411058.232018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411058.371018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411058.495876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411058.626306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411058.761464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411058.890120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411059.014885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411059.155374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411059.275356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411059.392110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411059.522061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411059.645897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411059.787099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411059.904812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411060.050212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411060.164938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411060.290004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411060.421791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411060.561788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411060.740110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411060.869700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411060.991364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411061.122329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411061.257876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411061.381353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411061.510825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411061.637658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411061.752548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411061.896720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411062.035614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411062.155140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411062.286359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411062.413743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411062.559103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411062.699848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411062.822749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411062.956182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411063.096330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411063.216596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411063.342021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411063.473879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411063.600737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411063.740013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411063.873021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411064.026133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411064.137454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411064.263072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411064.400746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411064.522449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411064.640682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411064.766644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411064.896074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411065.023441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411065.150621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411065.271690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411065.402146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411065.539270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411065.648317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411065.792519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411065.897214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411066.028608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411066.152204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411066.304512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411066.422331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411066.566447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411066.691769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411066.833648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411066.953139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411067.081167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411067.212091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411067.330902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411067.452779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411067.598857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411067.710377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411067.848024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411067.990697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411068.118250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411068.245863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411068.387024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411068.508921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411068.642861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411068.760202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411068.895127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411069.017663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411069.145523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411069.270693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411069.411330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411069.523994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411069.653367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411069.789751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411069.918377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411070.043896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411070.193850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411070.315885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411070.445338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411070.562024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411070.701833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411070.821727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411070.962138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411071.083338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411071.226574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411071.359666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411071.465163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411071.597319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411071.750528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411071.874504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411072.016095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411072.130275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411072.262791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411072.392388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411072.520212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411072.639102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411072.771269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411072.891796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411073.022006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411073.149162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411073.280874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411073.399770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411073.536538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411073.653867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411073.786057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411073.934252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411074.073277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411074.194481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411074.327961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411074.443553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411074.575901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411074.699991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411074.829312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411074.953071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411075.084206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411075.210822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411075.330904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411075.456920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411075.580397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411075.697955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411075.836343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411075.956551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411076.085437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411076.211322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411076.351903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411076.495667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411076.634969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411076.758219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411076.893941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411077.019032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411077.180226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411077.289909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411077.424668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411077.562013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411077.688632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411077.816391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411077.953004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411078.082303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411078.224651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411078.336096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411078.462099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411078.584888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411078.714502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411078.846017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411078.991085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411079.120646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411079.233410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411079.381973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411079.532276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411079.636719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411079.773200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411079.897111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411080.025283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411080.148890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411080.291297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411080.402395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411080.535026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411080.658612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411080.787414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411080.911942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411081.044516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411081.175214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411081.309965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411081.443514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411081.597958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411081.701062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411081.836329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411081.958993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411082.092907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411082.219923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411082.347694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411082.492511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411082.622059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411082.759427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411082.889237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411083.019826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411083.146184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411083.271745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411083.418248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411083.540883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411083.680477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411083.813722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411083.941918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411084.070267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411084.201647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411084.322456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411084.465235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411084.577615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411084.704445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411084.825482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411084.955890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411085.088635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411085.205711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411085.330131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411085.452718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411085.598547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411085.709352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411085.839426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411085.998610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411086.120303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411086.255784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411086.379836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411086.519493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411086.635416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411086.768063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411086.889853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411087.020642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411087.141215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411087.267631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411087.391688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411087.525517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411087.648895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411087.777285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411087.905265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411088.043084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411088.176400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411088.312927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411088.448163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411088.582023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411088.694309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411088.826235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411088.954976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411089.081252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411089.202010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411089.334577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411089.456510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411089.593247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411089.719065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411089.849197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411089.975552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411090.114891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411090.243376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411090.388500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411090.505355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411090.630162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411090.763260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411090.890444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411091.021458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411091.144953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411091.265156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411091.393448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411091.507570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411091.634305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411091.754279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411091.895309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411092.017217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411092.148325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411092.274800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411092.409514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411092.537938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411092.676304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411092.804662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411092.941548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411093.067862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411093.203434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411093.324840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411093.457355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411093.578527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411093.712132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411093.826313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411093.959268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411094.205177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411094.596353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411094.868536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411095.114243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411095.336046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411095.509115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411095.684368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411095.868928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411096.054796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411096.212667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411096.427819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411096.586064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411096.746095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411096.944112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411097.097150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411097.261521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411097.419847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411097.597322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411097.786061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411097.954745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411098.161266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411098.412109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411098.523807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411098.701527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411098.872577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411099.023757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411099.204256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411099.355546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411099.556420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411099.711467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411099.933648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411100.114054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411100.270046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411100.400236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411100.597692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411100.847151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411101.014656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411101.146373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411101.271684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411101.401167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411101.537057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411101.662041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411101.825944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411101.962109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411102.084312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411102.217605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411102.340238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411102.477943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411102.616251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411102.746964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411102.886408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411103.017997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411103.137918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411103.269258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411103.392812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411103.514113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411103.643293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411103.822672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411104.032295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411104.162907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411104.300629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411104.426810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411104.545732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411104.682072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411104.831982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411104.945248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411105.078933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411105.203642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411105.326676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411105.454066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411105.583541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411105.705754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411105.831931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411105.957138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411106.087568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411106.225707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411106.337801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411106.471950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411106.596027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411106.718870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411106.867835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411107.001544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411107.122014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411107.253894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411107.373777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411107.502598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411107.629582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411107.781417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411107.896900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411108.021893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411108.158734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411108.276027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411108.409892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411108.537114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411108.679159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411108.798215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411108.935459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411109.082310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411109.207404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411109.332342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411109.462043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411109.586560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411109.707535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411109.848067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411109.965253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411110.099916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411110.226007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411110.351705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411110.485858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411110.620191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411110.745417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411110.877568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411111.030181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411111.143636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411111.274814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411111.392296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411111.521337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411111.647741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411111.777029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411111.909575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411112.056630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411112.181097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411112.309457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411112.435982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411112.575079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411112.691396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411112.843287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411112.949477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411113.104790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411113.222002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411113.337554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411113.459537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411113.597544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411113.727407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411113.858682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411114.005079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411114.136079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411114.279742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411114.395634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411114.520736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411114.643805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411114.771817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411114.884695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411115.030450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411115.142698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411115.264041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411115.393206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411115.516303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411115.635717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411115.772412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411115.910815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411116.036023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411116.177318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411116.308288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411116.434275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411116.556539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411116.692880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411116.806660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411116.938158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411117.062065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411117.199796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411117.315455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411117.450036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411117.567632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411117.715549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411117.827878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411117.943588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411118.072574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411118.198780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411118.323652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411118.445076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411118.576823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411118.706129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411118.829643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411118.958446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411119.081163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411119.213039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411119.335099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411119.464282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411119.587517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411119.720483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411119.870425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411119.994456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411120.134735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411120.256091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411120.386795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411120.534891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411120.646632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411120.773669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411120.902181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411121.030707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411121.151169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411121.284286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411121.429722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411121.536900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411121.671252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411121.838447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411121.939504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411122.056449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411122.195386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411122.333463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411122.454654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411122.582321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411122.721892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411122.837505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411122.978005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411123.093515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411123.224292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411123.356309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411123.489041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411123.628926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411123.755802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411123.878562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411124.001275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411124.138571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411124.259143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411124.405944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411124.507898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411124.641415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411124.766245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411124.894717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411125.017189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411125.155245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411125.268091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411125.382815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411125.517808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411125.646965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411125.763122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411125.895972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411126.022393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411126.164896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411126.278220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411126.412092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411126.531980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411126.667594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411126.777997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411126.911204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411127.043971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411127.189319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411127.311379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411127.451364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411127.576178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411127.700390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411127.821987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411127.947995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411128.071111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411128.199435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411128.324450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411128.458060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411128.584662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411128.708114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411128.833738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411128.965359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411129.100870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411129.228001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411129.366913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411129.494881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411129.629595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411129.760525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411129.876129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411130.014567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411130.132701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411130.268042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411130.393308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411130.520872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411130.649001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411130.784352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411130.903147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411131.042649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411131.182957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411131.294139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411131.443034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411131.576152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411131.687094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411131.830141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411131.954758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411132.084827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411132.208235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411132.342452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411132.475678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411132.598503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411132.734463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411132.855582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411132.994125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411133.123421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411133.260463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411133.388838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411133.508976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411133.635628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411133.760700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411133.894035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411134.014259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411134.146667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411134.268499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411134.403302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411134.535472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411134.676240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411134.812267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411134.937303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411135.080958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411135.212053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411135.334801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411135.469088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411135.589911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411135.747042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411135.846005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411135.989848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411136.125045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411136.255813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411136.373797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411136.505370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411136.633487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411136.751966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411136.895342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411137.036031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411137.145349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411137.266850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411137.391168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411137.517610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411137.657223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411137.766087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411137.892270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411138.012898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411138.152527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411138.271872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411138.407429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411138.522120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411138.642747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411138.783344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411138.908525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411139.051234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411139.167549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411139.304263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411139.416146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411139.555794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411139.687082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411139.843499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411139.951918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411140.082341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411140.202041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411140.331830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411140.456365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411140.582789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411140.710128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411140.838049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411140.963915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411141.105539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411141.240448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411141.363153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411141.492317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411141.653414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411141.759730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411141.898641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411142.010717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411142.143561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411142.269336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411142.405974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411142.525521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411142.658724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411142.783145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411142.930266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411143.055004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411143.185640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411143.309947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411143.438803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411143.563078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411143.684713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411143.821287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411143.951630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411144.078490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411144.206000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411144.330509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411144.461432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411144.592695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411144.711998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411144.846981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411144.962152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411145.088583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411145.240497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411145.344693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411145.472765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411145.607805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411145.759507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411145.889865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411146.016598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411146.135409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411146.260504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411146.387230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411146.509411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411146.651310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411146.767142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411146.890326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411147.016704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411147.139666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411147.270839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411147.395708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411147.517154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411147.636055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411147.769067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411147.898823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411148.021689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411148.138259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411148.284225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411148.397133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411148.526279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411148.651033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411148.787539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411148.899209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411149.033471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411149.151876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411149.306762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411149.421302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411149.563023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411149.694540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411149.829714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411149.948826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411150.079976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411150.204027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411150.332777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411150.448648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411150.581015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411150.705460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411150.833949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411150.952414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411151.083521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411151.203290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411151.332144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411151.457222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411151.590462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411151.719293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411151.848623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411151.991827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411152.129073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411152.247932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411152.385218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411152.511048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411152.640107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411152.761208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411152.886270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411153.013613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411153.154509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411153.265971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411153.390787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411153.523423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411153.649454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411153.774646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411153.906254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411154.023916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411154.161157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411154.288361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411154.410061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411154.532574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411154.670846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411154.787038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411154.925640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411155.066412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411155.181762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411155.310885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411155.448852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411155.572180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411155.713504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411155.818762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411155.946646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411156.058388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411156.188870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411156.320508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411156.445846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411156.573638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411156.704324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411156.829978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411156.957673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411157.080826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411157.213277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411157.337426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411157.459301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411157.582558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411157.713967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411157.839693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411157.978833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411158.108438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411158.239771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411158.375871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411158.506085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411158.626549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411158.763519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411158.883795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411159.005355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411159.135285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411159.280437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411159.388263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411159.530980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411159.658109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411159.802930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411159.933840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411160.073565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411160.193498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411160.325595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411160.445708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411160.577109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411160.699498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411160.828362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411160.952183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411161.083950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411161.210800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411161.331831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411161.460490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411161.593701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411161.743592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411161.906199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411162.008759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411162.139210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411162.265589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411162.392972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411162.519293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411162.652382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411162.776787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411162.908843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411163.039102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411163.165576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411163.299453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411163.428027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411163.556440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411163.702386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411163.834635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411163.977182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411164.097713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411164.227131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411164.368281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411164.492610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411164.639289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411164.780778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411164.883303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411165.009045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411165.142940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411165.270816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411165.398904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411165.537111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411165.664034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411165.769291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411165.913905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411166.052695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411166.178769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411166.304805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411166.435768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411166.573626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411166.697225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411166.836584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411166.968031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411167.082274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411167.201127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411167.329281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411167.453033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411167.577873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411167.711318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411167.830228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411167.959658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411168.088261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411168.223911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411168.347837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411168.470321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411168.612174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411168.757418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411168.900363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411169.013494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411169.148326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411169.265071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411169.389548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411169.520193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411169.658559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411169.784067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411169.936505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411170.058809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411170.189812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411170.322189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411170.449630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411170.575472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411170.700510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411170.837816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411170.955228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411171.074298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411171.206258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411171.325670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411171.457845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411171.584325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411171.712059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411171.832855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411171.956882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411172.083284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411172.208444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411172.329636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411172.461080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411172.593175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411172.725188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411172.836689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411172.969837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411173.098493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411173.220215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411173.355562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411173.490385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411173.623230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411173.762452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411173.886033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411174.017254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411174.137770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411174.268357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411174.395001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411174.526332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411174.651503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411174.774363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411174.901681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411175.031629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411175.159477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411175.299488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411175.418745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411175.566936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411175.713602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411175.831111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411175.963450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411176.094659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411176.221776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411176.358067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411176.474201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411176.631595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411176.748255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411176.883582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411177.009865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411177.128855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411177.254727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411177.402332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411177.511836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411177.639245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411177.761493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411177.894239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411178.025578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411178.145250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411178.266838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411178.388732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411178.518208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411178.635644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411178.762170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411178.889817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411179.028549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411179.158093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411179.264975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411179.386712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411179.516020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411179.664507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411179.768612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411179.909246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411180.022160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411180.159893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411180.281297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411180.416259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411180.553043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411180.703386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411180.823384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411180.952050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411181.075603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411181.200645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411181.318263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411181.449333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411181.580030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411181.694417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411181.821181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411181.973761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411182.078584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411182.199229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411182.335086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411182.475457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411182.591294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411182.734665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411182.846215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411182.982095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411183.101703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411183.234762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411183.363568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411183.495603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411183.640300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411183.764992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411183.919688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411184.074086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411184.196543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411184.327139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411184.453829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411184.574812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411184.696890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411184.825153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411184.952937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411185.078566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411185.196163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411185.318899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411185.446383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411185.575176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411185.702234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411185.822224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411185.948411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411186.077080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411186.342712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411186.544709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411186.811407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411187.082833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411187.250998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411187.382649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411187.500331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411187.625010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411187.758338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411187.889927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411188.018177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411188.139665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411188.262543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411188.390010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411188.517605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411188.670577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411188.783399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411188.916744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411189.040844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411189.182150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411189.310055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411189.443744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411189.560886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411189.697141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411189.822922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411189.947823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411190.075541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411190.215948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411190.323762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411190.439972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411190.575532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411190.703794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411190.827497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411190.969769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411191.078316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411191.209823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411191.324833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411191.455095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411191.576524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411191.710827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411191.835620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411191.968566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411192.094388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411192.277993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411192.408194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411192.533358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411192.666611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411192.804516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411192.943237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411193.081264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411193.199130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411193.335967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411193.449813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411193.580531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411193.696100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411193.829533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411193.976803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411194.101197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411194.227183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411194.361022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411194.491856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411194.612317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411194.757470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411194.882155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411195.019448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411195.134436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411195.262267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411195.389087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411195.513950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411195.655657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411195.763883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411195.889032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411196.030565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411196.154238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411196.282113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411196.402889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411196.539486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411196.662574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411196.783502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411196.948024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411197.065119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411197.194234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411197.317764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411197.452892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411197.576914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411197.701357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411197.826363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411197.971245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411198.074322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411198.200245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411198.329715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411198.470399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411198.590963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411198.724307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411198.863579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411198.992193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411199.126305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411199.259300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411199.405010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411199.510054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411199.640274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411199.767951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411199.903525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411200.032606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411200.167732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411200.299452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411200.430005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411200.568960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411200.699201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411200.827007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411200.955489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411201.083106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411201.230393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411201.344644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411201.464062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411201.608889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411201.729575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411201.872247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411201.997630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411202.123227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411202.259492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411202.404674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411202.517966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411202.647879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411202.770492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411202.905189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411203.026186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411203.178011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411203.303189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411203.431627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411203.558943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411203.687555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411203.823241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411203.946739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411204.076789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411204.204594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411204.329165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411204.472472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411204.580720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411204.706203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411204.833066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411204.982370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411205.095277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411205.223662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411205.350645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411205.494030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411205.634361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411205.757117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411205.885950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411206.026823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411206.132498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411206.252133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411206.389213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411206.513322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411206.640018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411206.765630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411206.878800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411207.011339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411207.140921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411207.267585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411207.403805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411207.514480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411207.636764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411207.763766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411207.890068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411208.016734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411208.161011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411208.281413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411208.410327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411208.551077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411208.678130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411208.811293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411208.938533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411209.073503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411209.188275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411209.318696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411209.448863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411209.578925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411209.705462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411209.828246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411209.958452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411210.082563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411210.205473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411210.332993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411210.457457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411210.597301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411210.720187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411210.859285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411210.992751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411211.122795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411211.250617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411211.375183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411211.500422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411211.631469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411211.754650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411211.881202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411212.004175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411212.136920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411212.263133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411212.388520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411212.508701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411212.636144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411212.752750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411212.883650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411213.012748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411213.144293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411213.268761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411213.396562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411213.532805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411213.664664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411213.793664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411213.939715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411214.054010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411214.265835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411214.592353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411214.883178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411215.158909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411215.466303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411215.656518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411215.880232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411216.057549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411216.244732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411216.431756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411216.596987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411216.771791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411216.956249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411217.126718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411217.285184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411217.452496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411217.619945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411217.798446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411218.010799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411218.166291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411218.324428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411218.468462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411218.681022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411218.897994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411219.033106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411219.167600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411219.325848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411219.517798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411219.707523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411219.865123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411220.039359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411220.207787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411220.397456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411220.570891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411220.752019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411220.909773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411221.064475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411221.345158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411221.604102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411221.719246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411221.878816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411222.001425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411222.133137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411222.263106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411222.392924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411222.517837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411222.643109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411222.767145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411222.896466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411223.020888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411223.159127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411223.289911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411223.434028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411223.574228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411223.701318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411223.838118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411223.971638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411224.093673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411224.215199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411224.438344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411224.615568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411224.750606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411224.878309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411225.020185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411225.129979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411225.271296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411225.392247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411225.530625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411225.645046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411225.777997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411225.909047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411226.051504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411226.177410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411226.317163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411226.454401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411226.571914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411226.690948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411226.822364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411226.948381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411227.078970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411227.214741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411227.326260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411227.452338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411227.574974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411227.726225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411227.841457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411227.970730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411228.109833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411228.232079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411228.372981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411228.497072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411228.632971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411228.758055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411228.887108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411229.012030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411229.141829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411229.279828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411229.418424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411229.580730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411229.707253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411229.846727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411229.957191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411230.083243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411230.208398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411230.341622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411230.469606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411230.592680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411230.747835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411230.862966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411231.004184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411231.118654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411231.262218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411231.384670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411231.505053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411231.628930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411231.759961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411231.879593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411232.031730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411232.139920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411232.261912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411232.387954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411232.546484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411232.665550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411232.796885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411232.926564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411233.060050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411233.188588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411233.316452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411233.459670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411233.589552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411233.705337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411233.832659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411233.964133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411234.114740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411234.244402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411234.384032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411234.498250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411234.624374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411234.753907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411234.886927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411235.011632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411235.134194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411235.270188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411235.386499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411235.508959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411235.645915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411235.775500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411235.913176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411236.046872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411236.173781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411236.310321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411236.438709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411236.564427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411236.698376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411236.835164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411236.956544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411237.065333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411237.201557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411237.335382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411237.452517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411237.577050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411237.718589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411237.821514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411237.953185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411238.078794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411238.209163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411238.344131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411238.468419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411238.599857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411238.740638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411238.877518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411239.002738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411239.127920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411239.261813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411239.388613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411239.514409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411239.637056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411239.770166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411239.909359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411240.038934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411240.191799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411240.326283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411240.443191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411240.577449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411240.722894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411240.840840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411240.966215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411241.100553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411241.239720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411241.385930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411241.498359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411241.643802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411241.758224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411241.892609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411242.015844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411242.151770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411242.281632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411242.427922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411242.570258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411242.688340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411242.814759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411242.946400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411243.079742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411243.204770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411243.330781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411243.461870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411243.593003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411243.717113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411243.849344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411243.969953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411244.114972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411244.256896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411244.381824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411244.513829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411244.632999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411244.766315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411244.887493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411245.030874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411245.137927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411245.303507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411245.403658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411245.546593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411245.676552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411245.819319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411245.961601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411246.084717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411246.199792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411246.333935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411246.468604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411246.604205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411246.724523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411246.859047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411246.994186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411247.115258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411247.261540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411247.380929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411247.512760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411247.639065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411247.764369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411247.890156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411248.020642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411248.137923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411248.265854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411248.391345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411248.517365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411248.655436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411248.782558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411248.923278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411249.052737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411249.189736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411249.315813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411249.440369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411249.563052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411249.696924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411249.824255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411249.955432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411250.082837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411250.214409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411250.342794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411250.479614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411250.612236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411250.755399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411250.890814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411251.008980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411251.132344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411251.264401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411251.386287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411251.517699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411251.642568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411251.805688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411251.927222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411252.062447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411252.188503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411252.325704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411252.455299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411252.584295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411252.696523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411252.823537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411252.944585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411253.081008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411253.201928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411253.327660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411253.445510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411253.592946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411253.700674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411253.821568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411253.954377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411254.083650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411254.217606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411254.356240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411254.482355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411254.607080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411254.742137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411254.884632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411255.006621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411255.136232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411255.266615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411255.388587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411255.514765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411255.637544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411255.758394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411255.887192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411256.014840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411256.137993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411256.260011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411256.391464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411256.519491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411256.651960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411256.779598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411256.936099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411257.057612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411257.190169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411257.331216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411257.457513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411257.577004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411257.714293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411257.832804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411257.972136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411258.092501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411258.256293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411258.379757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411258.494073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411258.631643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411258.767843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411258.884278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411259.018613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411259.140123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411259.272139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411259.395208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411259.525041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411259.649011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411259.785685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411259.913080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411260.058600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411260.182134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411260.321450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411260.446945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411260.591770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411260.696950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411260.843395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411260.958797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411261.084699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411261.217530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411261.349693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411261.488879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411261.616810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411261.749264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411261.888237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411262.016406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411262.138782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411262.258750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411262.390118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411262.514106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411262.655211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411262.773013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411262.881687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411263.018537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411263.147528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411263.276369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411263.417142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411263.550121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411263.679210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411263.829310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411263.942894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411264.072050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411264.200643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411264.320979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411264.451438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411264.576407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411264.700261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411264.822718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411264.956763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411265.091951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411265.224900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411265.328103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411265.453034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411265.581877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411265.704422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411265.826572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411265.962171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411266.082132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411266.210293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411266.328296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411266.478162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411266.602454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411266.723205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411266.861362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411266.994287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411267.122180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411267.256601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411267.398578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411267.514778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411267.638340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411267.769724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411267.895074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411268.033138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411268.162265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411268.308351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411268.441859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411268.588453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411268.698405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411268.830598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411268.955990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411269.088135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411269.214551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411269.351055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411269.488661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411269.624474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411269.756492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411269.906198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411270.017413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411270.139678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411270.274046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411270.419440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411270.548862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411270.668041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411270.802503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411270.941653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411271.072675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411271.209752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411271.343196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411271.460810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411271.587091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411271.740951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411271.868663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411271.995792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411272.135066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411272.252897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411272.379055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411272.536111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411272.652537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411272.779473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411272.903885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411273.068922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411273.174901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411273.310430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411273.433809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411273.554787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411273.698886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411273.835523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411273.941581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411274.077688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411274.207064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411274.341539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411274.467694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411274.589545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411274.714087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411274.858651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411274.983507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411275.124311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411275.270530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411275.452145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411275.577732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411275.705919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411275.832584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411275.980050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411276.099057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411276.228689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411276.364505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411276.490725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411276.637799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411276.754715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411276.882745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411277.026734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411277.137517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411277.265491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411277.400743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411277.528398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411277.662229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411277.826970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411277.964247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411278.080096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411278.201628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411278.340950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411278.466780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411278.602232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411278.726157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411278.859829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411278.992598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411279.121867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411279.248470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411279.402488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411279.510340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411279.645088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411279.779373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411279.921962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411280.049072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411280.198225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411280.323903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411280.449363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411280.572850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411280.707544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411280.828529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411280.968253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411281.091371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411281.253608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411281.362682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411281.490615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411281.626679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411281.780794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411281.910351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411282.050139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411282.199730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411282.324538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411282.444986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411282.577648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411282.698761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411282.842639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411282.968103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411283.084743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411283.205891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411283.335812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411283.470680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411283.623914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411283.742628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411283.887256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411284.011321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411284.139659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411284.261287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411284.389098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411284.533349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411284.645449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411284.779205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411284.903755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411285.042571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411285.195725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411285.324785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411285.447412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411285.575855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411285.699627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411285.814030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411285.939985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411286.073657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411286.197836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411286.327275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411286.458772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411286.576428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411286.705175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411286.831187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411286.957818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411287.084776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411287.219505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411287.349076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411287.491613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411287.626583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411287.765820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411287.907671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411288.013066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411288.153936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411288.279174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411288.405061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411288.552697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411288.660150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411288.801482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411288.934561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411289.064061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411289.194490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411289.328799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411289.469280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411289.588300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411289.716628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411289.862659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411289.998744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411290.118546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411290.266121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411290.373445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411290.503395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411290.630402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411290.756965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411290.888428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411291.019878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411291.147753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411291.276458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411291.403677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411291.532647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411291.656480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411291.807890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411291.943788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411292.073815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411292.212582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411292.322699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411292.452635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411292.575791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411292.719123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411292.829140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411292.956832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411293.081511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411293.215954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411293.356732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411293.473195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411293.598785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411293.751127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411293.876376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411294.002274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411294.153366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411294.275722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411294.411146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411294.555673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411294.671315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411294.803560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411294.946406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411295.090576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411295.210800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411295.317722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411295.452401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411295.586472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411295.734163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411295.872151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411296.002505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411296.135505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411296.256354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411296.390059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411296.509837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411296.635170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411296.761888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411296.902885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411297.011881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411297.158454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411297.281642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411297.411618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411297.517875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411297.654285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411297.776287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411297.925092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411298.050273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411298.182945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411298.310535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411298.446087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411298.568278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411298.691093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411298.815412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411298.965307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411299.081032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411299.201433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411299.326831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411299.450773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411299.582978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411299.709146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411299.837562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411299.981428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411300.115245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411300.236973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411300.380416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411300.512089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411300.643618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411300.775303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411300.907326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411301.028544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411301.158034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411301.309862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411301.441585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411301.563887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411301.691576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411301.823576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411301.950812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411302.076413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411302.210270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411302.329507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411302.456115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411302.591429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411302.724207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411302.861502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411302.993348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411303.109921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411303.247409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411303.375679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411303.518945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411303.666873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411303.779609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411303.901539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411304.033300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411304.175310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411304.310237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411304.443871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411304.564276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411304.692893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411304.811700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411304.948611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411305.071740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411305.197523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411305.322224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411305.445250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411305.573621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411305.698040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411305.823990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411305.950978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411306.075752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411306.203428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411306.329083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411306.462368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411306.611952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411306.738950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411306.857571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411306.992620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411307.120645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411307.261371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411307.381252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411307.527880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411307.634818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411307.764856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411307.900963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411308.032410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411308.152116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411308.287799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411308.428237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411308.551870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411308.674499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411308.807085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411308.946431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411309.075829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411309.190922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411309.315764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411309.441035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411309.567222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411309.689856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411309.829430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411309.945216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411310.076783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411310.200558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411310.326718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411310.451176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411310.593670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411310.714036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411310.846080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411310.987842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411311.123820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411311.246482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411311.369604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411311.496159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411311.629651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411311.768541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411311.895526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411312.029654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411312.161496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411312.288799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411312.437492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411312.558455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411312.684363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411312.813746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411312.944801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411313.067736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411313.198232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411313.319338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411313.449446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411313.570526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411313.699606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411313.827185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411313.960301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411314.085138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411314.222322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411314.341938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411314.486208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411314.622351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411314.756063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411314.872999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411315.008054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411315.123157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411315.261256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411315.377963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411315.503634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411315.636350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411315.766027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411315.893834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411316.027772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411316.153749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411316.298646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411316.428080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411316.564006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411316.681961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411316.822936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411316.939751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411317.090599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411317.193333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411317.324010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411317.456702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411317.589845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411317.727964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411317.848521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411317.992952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411318.114796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411318.254515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411318.397631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411318.501671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411318.626984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411318.756948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411318.887377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411319.010628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411319.141165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411319.255708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411319.383946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411319.519678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411319.639567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411319.760793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411319.890300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411320.015350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411320.141094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411320.264667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411320.402275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411320.544727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411320.671942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411320.803598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411320.944935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411321.062484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411321.196414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411321.326695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411321.449848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411321.584898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411321.698994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411321.821728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411321.950359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411322.075250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411322.213230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411322.327055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411322.453235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411322.572863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411322.701910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411322.823661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411322.953536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411323.082883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411323.207982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411323.338947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411323.480225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411323.601917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411323.743479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411323.870207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411324.000623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411324.125817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411324.256305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411324.383028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411324.527781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411324.636243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411324.759822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411324.887768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411325.016666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411325.141157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411325.267715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411325.403157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411325.530364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411325.670978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411325.793625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411325.940664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411326.056894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411326.190979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411326.317961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411326.441864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411326.575201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411326.705832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411326.826591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411326.946521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411327.073994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411327.204002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411327.333187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411327.460009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411327.577583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411327.704237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411327.841500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411327.974010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411328.108070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411328.230342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411328.368397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411328.503520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411328.629942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411328.760999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411328.899653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411329.005430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411329.129881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411329.258084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411329.390767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411329.510247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411329.640263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411329.775536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411329.905884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411330.027217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411330.142734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411330.276507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411330.407914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411330.560302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411330.691054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411330.810143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411330.926788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411331.059771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411331.195149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411331.333500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411331.449195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411331.567582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411331.695859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411331.820469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411331.949507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411332.075630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411332.197943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411332.326995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411332.454535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411332.572711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411332.702020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411332.823567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411332.951843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411333.070910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411333.200702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411333.326625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411333.453636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411333.590134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411333.704061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411333.826459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411333.951870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411334.072798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411334.205461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411334.318497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411334.452272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411334.576794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411334.713790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411334.839044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411334.993364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411335.265269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411335.644803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411335.956071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411336.245640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411336.446851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411336.636176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411336.859009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411337.024630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411337.197827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411337.386702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411337.513335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411337.680305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411337.867340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411338.023595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411338.211071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411338.382059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411338.554533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411338.736475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411338.902960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411339.090704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411339.228711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411339.462061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411339.678074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411339.837372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411339.990261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411340.145799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411340.324994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411340.502580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411340.730721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411340.861748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411341.012147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411341.194188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411341.332786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411341.506041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411341.695613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411341.908921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411342.206743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411342.369572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411342.504866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411342.624927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411342.762674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411342.879680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411343.012064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411343.140650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411343.261998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411343.380544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411343.509869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411343.638117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411343.786148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411343.897071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411344.028655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411344.143950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411344.270483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411344.422345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411344.535559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411344.667677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411344.815990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411344.939393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411345.120940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411345.422935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411345.626852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411345.827206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411345.962038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411346.093493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411346.258726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411346.388645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411346.538533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411346.687464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411346.821978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411346.988560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411347.126055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411347.258836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411347.451107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411347.612484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411347.754363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411347.899043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411348.078332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411348.191794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411348.341179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411348.498102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411348.642325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411348.779150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411348.928950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411349.066589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411349.278494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411349.466176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411349.645939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411349.783974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411349.948647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411350.114842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411350.283845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411350.469489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411350.607186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411350.735591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411350.868823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411351.018410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411351.139629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411351.261047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411351.381251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411351.507817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411351.637283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411351.757979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411351.891054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411352.018080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411352.156094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411352.280568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411352.422622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411352.557503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411352.690471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411352.816034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411352.951687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411353.067836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411353.196558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411353.319676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411353.447352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411353.570859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411353.697175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411353.837049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411353.952579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411354.063902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411354.192688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411354.319672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411354.444220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411354.571173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411354.715430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411354.816514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411354.946507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411355.071749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411355.199007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411355.321424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411355.449954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411355.570118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411355.715064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411355.859074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411355.984905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411356.113505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411356.251295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411356.378820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411356.503640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411356.628246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411356.754924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411356.875409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411357.024547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411357.136765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411357.259367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411357.386048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411357.517198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411357.636600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411357.782035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411357.902720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411358.047548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411358.172390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411358.304159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411358.427675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411358.559376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411358.689248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411358.821635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411358.941453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411359.072465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411359.189266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411359.320702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411359.442141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411359.568292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411359.697096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411359.826054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411359.944860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411360.077069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411360.210925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411360.328597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411360.452580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411360.601758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411360.711726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411360.853822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411360.993986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411361.120883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411361.253642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411361.380044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411361.497711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411361.631695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411361.750978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411361.886116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411362.002701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411362.134242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411362.260172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411362.391196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411362.528284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411362.656235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411362.796578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411362.930922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411363.057311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411363.211620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411363.366861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411363.488796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411363.615753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411363.749937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411363.869460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411363.997933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411364.133171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411364.256675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411364.376785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411364.506094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411364.629271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411364.761536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411364.880327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411365.011423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411365.129680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411365.259731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411365.380394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411365.514712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411365.643064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411365.760883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411365.882743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411366.027281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411366.130440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411366.253152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411366.386211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411366.527238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411366.646797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411366.781888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411366.931106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411367.054696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411367.177781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411367.310298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411367.437896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411367.571639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411367.695473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411367.818417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411367.945794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411368.074577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411368.194167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411368.325647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411368.454878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411368.580126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411368.704792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411368.831115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411368.958040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411369.092764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411369.225935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411369.362886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411369.496373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411369.627944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411369.757307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411369.879699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411370.004406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411370.137673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411370.255938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411370.384976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411370.501897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411370.637796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411370.762028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411370.892219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411371.013491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411371.144586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411371.265903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411371.403641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411371.535063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411371.653592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411371.815053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411371.938383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411372.059575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411372.196898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411372.307456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411372.447517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411372.572445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411372.711626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411372.815161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411372.953550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411373.076806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411373.212632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411373.333470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411373.489872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411373.593265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411373.733989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411373.870002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411373.994972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411374.124622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411374.250082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411374.376360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411374.504311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411374.623875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411374.756556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411374.882845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411375.011540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411375.138164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411375.267473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411375.387496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411375.520187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411375.667856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411375.784786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411375.917644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411377.075353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411377.285001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411377.427213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411377.593565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411377.742735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411377.863539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411378.001058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411378.130312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411378.251431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411378.380571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411378.510669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411378.635512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411378.754974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411378.882595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411379.005095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411379.133878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411379.262465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411379.394300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411379.513853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411379.644442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411379.772275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411379.894164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411380.039813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411380.160169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411380.295913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411380.420246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411380.556095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411380.694305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411380.813514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411380.951470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411381.075246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411381.206337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411381.336351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411381.477754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411381.615941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411381.747010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411381.876592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411382.005187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411382.131774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411382.275394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411382.379156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411382.531614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411382.630771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411382.763510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411382.879981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411383.010429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411383.134351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411383.258370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411383.389049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411383.512197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411383.632140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411383.764388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411383.894853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411384.029180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411384.151287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411384.272733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411384.405871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411384.535170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411384.670818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411384.797183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411384.933562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411385.069261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411385.194593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411385.315308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411385.445246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411385.575052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411385.717957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411385.829018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411385.954459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411386.091275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411386.211034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411386.332829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411386.463159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411386.589118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411386.712669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411386.842284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411386.982340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411387.131994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411387.251568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411387.387758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411387.505823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411387.635906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411387.756776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411387.886836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411388.005646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411388.129630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411388.250081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411388.377030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411388.505929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411388.633719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411388.753761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411388.884994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411389.007162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411389.138991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411389.256400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411389.388304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411389.515121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411389.644101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411389.780125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411389.907215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411390.047520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411390.186389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411390.309342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411390.440267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411390.573817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411390.693830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411390.832650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411390.951089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411391.079299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411391.207773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411391.336004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411391.457465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411391.594760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411391.722578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411391.871860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411391.988345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411392.117294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411392.253153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411392.391058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411392.511072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411392.633594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411392.763735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411392.897405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411393.019106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411393.136815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411393.263860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411393.388389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411393.520689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411393.639795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411393.767628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411393.901972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411394.023787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411394.171801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411394.289995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411394.414953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411394.550737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411394.679434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411394.811436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411394.934340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411395.065478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411395.192829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411395.322421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411395.451410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411395.585618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411395.695124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411395.827239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411395.979676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411396.098826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411396.241477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411396.368657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411396.498740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411396.616523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411396.746222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411396.894595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411397.009813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411397.148764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411397.264041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411397.389309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411397.526808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411397.655776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411397.786077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411397.924881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411398.061765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411398.192349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411398.319088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411398.445735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411398.568572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411398.696754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411398.819625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411398.959845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411399.071014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411399.199695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411399.328546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411399.454599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411399.582887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411399.733870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411399.853786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411400.002084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411400.127291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411400.250587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411400.397150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411400.503815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411400.632247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411400.770469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411400.882210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411401.011380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411401.130347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411401.265075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411401.383250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411401.510631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411401.632453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411401.778564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411401.921243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411402.067419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411402.195024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411402.319038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411402.442634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411402.574248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411402.694776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411402.820970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411402.945831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411403.075930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411403.196145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411403.330235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411403.450109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411403.594797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411403.712521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411403.840700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411403.993297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411404.128665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411404.245044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411404.378751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411404.500233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411404.624863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411404.754015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411404.882878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411405.002582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411405.122268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411405.252603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411405.391163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411405.505689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411405.632566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411405.757493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411405.894638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411406.013727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411406.144644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411406.274273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411406.402443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411406.536011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411406.665056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411406.793744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411406.938851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411407.060930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411407.210658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411407.330294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411407.455520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411407.580601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411407.739264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411407.858716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411407.984153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411408.120431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411408.254438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411408.383670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411408.510794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411408.643660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411408.764493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411408.892174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411409.015151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411409.141517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411409.268843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411409.389025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411409.521580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411409.651898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411409.784148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411409.926989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411410.066656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411410.181428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411410.322184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411410.443352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411410.576463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411410.699322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411410.823584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411410.948976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411411.073636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411411.190991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411411.323116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411411.453059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411411.615351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411411.722336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411411.863211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411411.997748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411412.142983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411412.253257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411412.393404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411412.514315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411412.659459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411412.778210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411412.901715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411413.043263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411413.183162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411413.302284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411413.435491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411413.569982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411413.691647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411413.813680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411413.944091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411414.068155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411414.211773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411414.320546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411414.444810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411414.578010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411414.704898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411414.829268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411414.980946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411415.096916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411415.244925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411415.367681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411415.493706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411415.617357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411415.762073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411415.890309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411416.022968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411416.173866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411416.294374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411416.425807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411416.559420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411416.681323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411416.812089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411416.937573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411417.064382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411417.188526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411417.326609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411417.438754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411417.566735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411417.696523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411417.826427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411417.943320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411418.080168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411418.209074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411418.333856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411418.452506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411418.603133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411418.713629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411418.842248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411418.977688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411419.109661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411419.239252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411419.360044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411419.494841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411419.625887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411419.740782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411419.877638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411420.002336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411420.130339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411420.268115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411420.381044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411420.503119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411420.642086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411420.763774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411420.899071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411421.038352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411421.157272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411421.307222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411421.436483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411421.567840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411421.694200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411421.815559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411421.947500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411422.066864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411422.195286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411422.323950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411422.452389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411422.576493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411422.712732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411422.832333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411422.954334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411423.080723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411423.216222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411423.336864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411423.503290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411423.674814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411423.836561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411423.999836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411424.153365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411424.308157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411424.451952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411424.599778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411424.814341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411424.974162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411425.111367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411425.232073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411425.372619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411425.498788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411425.628028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411425.754683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411425.885278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411426.005158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411426.140813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411426.282763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411426.450932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411426.575443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411426.721680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411426.840908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411426.965706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411427.107305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411427.225238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411427.359339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411427.490987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411427.626577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411427.741015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411427.870550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411428.001266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411428.134764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411428.254800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411428.368132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411428.501838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411428.623857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411428.763507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411428.883276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411429.012518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411429.135780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411429.266991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411429.392967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411429.525565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411429.650098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411429.793719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411429.938719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411430.061848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411430.188669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411430.333612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411430.437515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411430.570953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411430.700918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411430.817188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411430.949681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411431.089141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411431.213931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411431.344602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411431.483058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411431.612576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411431.752450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411431.887432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411432.011752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411432.138530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411432.260862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411432.387739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411432.512125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411432.636375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411432.762282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411432.891227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411433.044329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411433.167754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411433.298947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411433.440766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411433.556226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411433.690368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411433.808520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411433.950956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411434.060293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411434.195193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411434.318481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411434.449224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411434.590382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411434.705354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411434.828332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411434.951886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411435.076939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411435.210014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411435.331312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411435.471909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411435.594933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411435.732486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411435.859913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411436.001756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411436.122778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411436.255459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411436.381571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411436.502754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411436.626895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411436.772969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411436.877821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411437.006026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411437.133609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411437.282526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411437.397097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411437.520576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411437.658633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411437.793883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411437.918575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411438.059260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411438.184928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411438.312062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411438.439691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411438.573905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411438.689819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411438.822039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411438.949496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411439.079760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411439.212064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411439.354008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411439.480517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411439.613533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411439.762558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411439.886404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411440.011415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411440.140808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411440.273081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411440.399661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411440.532521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411440.673561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411440.802095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411440.943135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411441.048337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411441.185127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411441.308788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411441.438819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411441.560996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411441.709533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411441.836387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411441.947312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411442.066182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411442.196716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411442.324361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411442.447194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411442.584338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411442.693723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411442.815822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411442.945067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411443.084840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411443.205950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411443.317787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411443.449698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411443.580286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411443.700470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411443.824980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411443.954145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411444.093594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411444.201710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411444.347072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411444.452216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411444.573820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411444.700987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411444.826237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411444.963388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411445.087595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411445.215376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411445.343373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411445.498127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411445.616802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411445.742493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411445.871999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411446.004344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411446.131004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411446.257643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411446.377037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411446.520996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411446.630776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411446.753887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411446.884499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411447.028921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411447.155785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411447.289359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411447.420030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411447.569184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411447.681134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411447.814867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411447.944133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411448.069777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411448.197430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411448.325147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411448.440230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411448.573507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411448.696922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411448.826736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411448.955187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411449.078519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411449.205117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411449.339151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411449.464233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411449.608950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411449.735650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411449.871102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411450.008198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411450.129801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411450.247091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411450.377936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411450.502861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411450.632686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411450.755443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411450.895582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411451.006295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411451.125499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411451.265594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411451.385239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411451.509794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411451.637990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411451.760329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411451.903631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411452.038289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411452.178454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411452.298686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411452.445154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411452.560451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411452.693852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411452.817836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411452.943040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411453.072814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411453.192215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411453.318990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411453.442811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411453.562373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411453.699205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411453.816739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411453.951190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411454.091247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411454.211475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411454.334232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411454.462706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411454.598500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411454.741962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411454.862054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411454.986908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411455.121707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411455.251964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411455.373142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411455.508575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411455.634823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411455.762993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411455.879555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411456.023383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411456.304909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411456.650904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411456.952612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411457.201578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411457.389838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411457.627080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411457.905544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411458.088376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411458.218919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411458.398251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411458.575279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411458.795494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411458.926667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411459.131907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411459.275750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411459.451479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411459.627384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411459.852430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411460.022944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411460.196073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411460.357869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411460.518469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411460.775110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411460.963742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411461.080584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411461.262686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411461.397752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411461.578419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411461.809660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411461.967023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411462.100457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411462.291442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411462.452321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411462.636795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411462.813739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411463.002654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411463.169220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411463.388154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411463.580363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411463.772325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411463.907171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411464.043690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411464.173945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411464.309424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411464.444348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411464.587582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411464.712763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411464.836511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411464.976347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411465.107925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411465.256594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411465.380981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411465.503669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411465.632199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411465.759805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411465.897113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411466.029875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411466.161731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411466.289071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411466.428297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411466.673842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411466.814577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411466.943548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411467.070918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411467.205494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411467.332728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411467.465267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411467.586527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411467.728019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411467.862314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411467.997631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411468.121900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411468.252332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411468.383625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411468.507086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411468.645118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411468.761832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411468.884151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411469.007143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411469.144141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411469.256797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411469.384009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411469.503988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411469.631060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411469.756936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411469.881525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411470.016111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411470.139276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411470.266845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411470.397244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411470.520421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411470.651100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411470.779404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411470.924677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411471.044970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411471.194079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411471.316905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411471.442642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411471.568262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411471.703732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411471.839788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411471.986306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411472.093882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411472.228087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411472.362650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411472.490354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411472.609748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411472.744531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411472.873755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411472.999912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411473.124942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411473.271062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411473.386106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411473.525993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411473.634217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411473.761628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411473.891685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411474.011008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411474.141930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411474.277826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411474.416521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411474.546912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411474.685191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411474.804729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411474.932012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411475.060566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411475.190542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411475.309802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411475.446632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411475.566761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411475.695724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411475.835441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411475.981133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411476.110319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411476.241097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411476.374082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411476.503523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411476.622973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411476.751148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411476.880717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411477.006516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411477.136420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411477.253807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411477.379656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411477.503307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411477.630889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411477.754765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411477.883036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411478.010195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411478.149551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411478.283201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411478.416385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411478.536364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411478.661249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411478.799687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411478.936235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411479.070786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411479.192595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411479.324842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411479.458786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411479.572456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411479.700644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411479.826976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411479.958874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411480.092713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411480.227242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411480.359846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411480.489300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411480.620039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411480.749506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411480.878381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411481.020365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411481.149197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411481.254434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411481.375191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411481.506571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411481.634564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411481.763471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411481.913504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411482.031597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411482.151250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411482.297362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411482.435700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411482.558309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411482.687087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411482.814622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411482.946028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411483.069310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411483.197215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411483.323083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411483.473254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411483.589106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411483.730576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411483.862292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411483.994313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411484.128481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411484.261689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411484.383367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411484.527888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411484.651650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411484.791013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411484.925759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411485.065575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411485.189026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411485.320289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411485.441368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411485.568009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411485.698620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411485.829663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411485.957116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411486.084704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411486.333408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411486.522288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411486.770587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411487.023175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411487.241271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411487.569085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411487.697233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411487.826267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411487.952536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411488.081342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411488.207394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411488.336062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411488.485813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411488.619259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411488.743124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411488.878843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411489.005927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411489.128866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411489.270577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411489.396187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411489.545347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411489.669429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411489.796626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411489.941172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411490.061300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411490.250307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411490.406308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411490.535489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411490.666297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411490.795214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411490.942942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411491.066023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411491.247478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411491.383915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411491.506912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411491.656551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411491.788445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411491.936863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411492.084841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411492.260888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411492.382485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411492.519753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411492.640302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411492.772549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411492.897228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411493.048420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411493.161655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411493.308248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411493.426939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411493.563515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411493.689703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411493.812840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411493.960083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411494.070435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411494.194614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411494.325205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411494.449617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411494.581404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411494.701924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411494.835981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411494.962212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411495.108015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411495.256901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411495.379158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411495.509510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411495.648808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411495.754838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411495.883847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411496.019221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411496.150281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411496.279587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411496.414507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411496.561090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411496.688615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411496.832719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411496.963490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411497.071832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411497.201255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411497.328669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411497.473674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411497.602735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411497.724779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411497.861558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411497.986056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411498.121869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411498.260930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411498.381013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411498.510313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411498.638937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411498.753957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411498.893867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411499.008133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411499.133647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411499.268561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411499.390598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411499.521950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411499.652961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411499.792535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411499.935806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411500.068548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411500.196626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411500.338375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411500.462735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411500.602240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411500.733738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411500.866262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411501.000883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411501.138937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411501.258986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411501.385364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411501.511198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411501.645952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411501.776883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411501.902061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411502.037162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411502.174268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411502.307221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411502.448475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411502.562028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411502.695344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411502.812335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411502.936245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411503.076313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411503.193572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411503.320307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411503.444047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411503.579368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411503.698987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411503.821466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411503.950178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411504.079125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411504.204055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411504.337977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411504.478142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411504.606036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411504.744410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411504.874783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411505.016674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411505.131058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411505.251027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411505.376780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411505.506396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411505.629282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411505.756459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411505.882376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411506.016155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411506.138450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411506.285855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411506.405136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411506.532083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411506.672295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411506.795887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411506.923413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411507.058014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411507.182055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411507.304686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411507.432676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411507.566468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411507.714286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411507.838439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411507.949471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411508.083997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411508.228976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411508.337434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411508.480353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411508.621823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411508.748492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411508.877266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411508.995725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411509.131614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411509.258789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411509.400310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411509.509699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411509.640992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411509.765044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411509.898387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411510.024593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411510.175048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411510.292736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411510.427670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411510.557174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411510.704132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411510.818377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411510.940073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411511.085775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411511.209660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411511.336193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411511.455104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411511.594664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411511.740529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411511.876588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411512.001984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411512.131329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411512.254174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411512.375287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411512.503627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411512.631450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411512.760021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411512.871498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411513.026942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411513.154618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411513.284371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411513.419684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411513.560796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411513.680002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411513.817137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411513.940895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411514.069669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411514.192574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411514.322067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411514.442647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411514.569060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411514.708852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411514.840427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411514.956974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411515.090204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411515.223624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411515.356225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411515.482087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411515.611956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411515.752267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411515.878475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411516.000712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411516.132971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411516.260273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411516.383673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411516.508254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411516.636555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411516.759492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411516.893231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411517.082900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411517.245012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411517.367281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411517.498214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411517.625602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411517.751636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411517.889859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411518.041964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411518.160187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411518.295301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411518.418908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411518.552572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411518.685232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411518.819256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411518.944008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411519.069419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411519.198547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411519.321282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411519.450163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411519.570880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411519.699859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411519.868999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411519.996165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411520.130568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411520.251016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411520.373908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411520.507098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411520.635491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411520.754678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411520.880121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411521.006932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411521.130946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411521.258164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411521.395158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411521.509018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411521.647784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411521.806709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411521.939404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411522.066771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411522.194438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411522.320023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411522.456311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411522.575339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411522.707394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411522.835037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411522.972742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411523.101073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411523.234927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411523.374552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411523.508211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411523.633694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411523.772010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411523.904955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411524.050370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411524.171169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411524.311281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411524.428302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411524.563745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411524.688416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411524.818523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411524.942796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411525.065019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411525.190726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411525.334501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411525.449930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411525.582053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411525.703821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411525.835829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411525.972521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411526.094187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411526.231471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411526.372914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411526.501749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411526.632103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411526.750433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411526.882877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411527.001302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411527.133530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411527.259314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411527.396692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411527.508807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411527.638409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411527.779518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411527.923463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411528.052415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411528.177046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411528.302788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411528.430789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411528.552698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411528.689729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411528.814512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411528.941246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411529.070769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411529.204125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411529.330827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411529.472575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411529.584774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411529.724431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411529.865546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411530.003901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411530.130079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411530.258893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411530.388726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411530.516915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411530.660614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411530.782876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411530.901245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411531.050020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411531.170348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411531.311275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411531.442501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411531.570585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411531.690436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411531.819335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411531.962206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411532.069531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411532.191224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411532.338132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411532.447025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411532.571902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411532.699040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411532.823621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411532.952109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411533.097144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411533.215259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411533.348490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411533.488347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411533.615512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411533.753537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411533.889565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411534.018830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411534.135698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411534.263101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411534.391297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411534.521295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411534.645305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411534.776327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411534.910320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411535.046479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411535.182822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411535.318403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411535.434224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411535.578430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411535.693108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411535.828081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411535.959515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411536.086415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411536.239711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411536.353287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411536.487155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411536.616408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411536.745052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411536.870783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411536.993728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411537.127899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411537.257128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411537.376968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411537.525067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411537.647151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411537.790587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411537.918096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411538.044574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411538.177483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411538.308386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411538.439819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411538.573181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411538.694889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411538.821749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411538.958372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411539.096710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411539.209169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411539.332088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411539.448331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411539.575622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411539.710583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411539.857891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411539.984596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411540.125969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411540.241776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411540.367870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411540.489408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411540.628370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411540.763699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411540.886161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411541.008391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411541.136161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411541.273764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411541.388458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411541.527475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411541.644747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411541.794028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411541.928785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411542.058135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411542.186804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411542.309863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411542.441188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411542.574067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411542.694033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411542.815108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411542.949827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411543.081609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411543.218172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411543.355029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411543.493762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411543.616251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411543.748820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411543.875367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411544.002654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411544.133551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411544.261831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411544.386704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411544.520852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411544.649322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411544.768774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411544.898216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411545.029795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411545.167614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411545.299479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411545.431862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411545.568545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411545.691516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411545.820382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411545.946223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411546.065804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411546.208466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411546.320735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411546.445752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411546.578353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411546.699986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411546.831631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411546.977323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411547.101165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411547.235474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411547.351844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411547.488719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411547.623980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411547.749695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411547.886625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411548.012588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411548.136769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411548.279370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411548.414175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411548.536595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411548.668714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411548.798985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411548.933298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411549.055590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411549.181077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411549.305591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411549.429292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411549.553127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411549.673876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411549.811098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411549.939806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411550.072538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411550.198985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411550.337301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411550.457371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411550.586780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411550.725758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411550.860767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411551.003676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411551.125506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411551.259860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411551.384517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411551.508662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411551.648029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411551.794210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411551.927266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411552.056701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411552.188935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411552.328670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411552.440590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411552.568174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411552.685262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411552.814882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411552.945793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411553.068186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411553.193281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411553.319037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411553.446951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411553.570081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411553.698406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411553.835538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411553.960222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411554.111866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411554.234014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411554.366038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411554.486660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411554.613253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411554.741107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411554.872544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411554.996555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411555.129419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411555.251267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411555.379367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411555.504381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411555.631034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411555.752582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411555.881610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411556.022446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411556.129518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411556.252543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411556.380684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411556.518589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411556.651651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411556.785460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411556.924877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411557.048889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411557.189633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411557.310164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411557.436675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411557.557205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411557.688273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411557.813860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411557.937816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411558.070645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411558.195600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411558.320541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411558.455799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411558.586773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411558.716449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411558.876894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411558.993095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411559.116928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411559.265961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411559.373225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411559.503828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411559.628485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411559.756334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411559.877413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411560.011366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411560.140213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411560.272028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411560.394188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411560.536587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411560.661705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411560.805644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411560.927761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411561.055758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411561.188514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411561.318835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411561.446558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411561.580079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411561.707006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411561.836329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411561.959952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411562.088104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411562.238208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411562.359252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411562.518455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411562.628837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411562.754064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411562.884654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411563.007003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411563.131871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411563.247528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411563.380329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411563.508932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411563.646653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411563.791882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411563.919684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411564.043150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411564.176460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411564.313819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411564.455515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411564.563715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411564.684973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411564.818443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411564.959925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411565.096121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411565.221715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411565.354001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411565.473043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411565.616193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411565.757271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411565.880117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411566.010326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411566.131233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411566.252296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411566.380322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411566.509339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411566.650496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411566.774427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411566.894239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411567.023858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411567.156260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411567.284669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411567.427406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411567.567961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411567.688884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411567.817560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411567.946136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411568.070990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411568.197100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411568.338459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411568.456741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411568.586994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411568.720447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411568.855865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411568.988007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411569.122131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411569.240797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411569.374254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411569.497453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411569.639586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411569.750846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411569.881735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411570.011441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411570.137280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411570.278784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411570.413661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411570.534408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411570.682007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411570.799348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411570.939363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411571.056551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411571.184022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411571.312311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411571.446691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411571.568007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411571.690397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411571.815624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411571.947685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411572.072121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411572.209559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411572.327420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411572.460017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411572.590429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411572.739284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411572.861125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411573.002360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411573.127413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411573.249085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411573.375603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411573.520003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411573.630660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411573.757856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411573.881737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411574.013158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411574.134365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411574.268905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411574.400072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411574.527910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411574.666735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411574.792154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411574.924620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411575.056161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411575.185048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411575.313464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411575.435701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411575.564204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411575.688120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411575.814488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411575.940752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411576.069710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411576.194869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411576.316135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411576.440506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411576.582337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411576.695263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411576.839575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411577.106788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411577.465172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411577.776983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411578.122080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411578.318214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411578.519667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411578.710421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411578.892078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411579.083115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411579.238525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411579.394237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411579.606090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411579.813915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411579.953845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411580.164356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411580.307889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411580.509148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411580.736062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411580.916970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411581.085072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411581.284113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411581.409902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411581.590578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411581.754019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411582.024173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411582.200818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411582.351764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411582.507963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411582.694663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411582.856991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411583.001607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411583.198584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411583.375422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411583.504838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411583.698234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411583.885832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411584.091928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411584.222828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411584.392795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411584.635604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411584.881165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411584.999211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411585.128518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411585.252346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411585.381459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411585.502093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411585.632560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411585.750842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411585.889371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411586.006854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411586.135262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411586.265224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411586.394682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411586.516125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411586.651258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411586.782749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411586.931289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411587.055255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411587.201839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411587.311429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411587.448740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411587.570188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411587.777981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411587.957012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411588.105572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411588.212195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411588.354028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411588.478922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411588.610608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411588.739840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411588.868003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411589.009746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411589.144303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411589.246740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411589.383486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411589.500381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411589.641355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411589.753433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411589.886777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411590.019476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411590.150478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411590.278015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411590.418994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411590.543499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411590.682279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411590.806561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411590.934853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411591.061211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411591.206824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411591.317246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411591.439271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411591.565061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411591.700703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411591.828360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411591.950295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411592.078388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411592.221968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411592.349559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411592.482736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411592.608229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411592.740548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411592.870036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411593.009149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411593.135087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411593.263200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411593.385490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411593.518305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411593.644322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411593.771114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411593.897855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411594.044838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411594.165696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411594.288765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411594.427583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411594.564052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411594.702864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411594.815112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411594.941917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411595.065257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411595.193513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411595.328205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411595.459529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411595.598676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411595.732784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411595.894395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411596.021446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411596.165642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411596.292546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411596.442492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411596.555578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411596.699307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411596.812059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411596.958872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411597.062523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411597.181972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411597.315960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411597.469297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411597.596776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411597.731275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411597.856156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411597.985762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411598.122476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411598.252304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411598.377299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411598.504345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411598.663487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411598.786792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411598.915004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411599.045123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411599.186069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411599.312716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411599.433674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411599.567827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411599.697696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411599.829535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411599.949424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411600.104732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411600.231382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411600.361305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411600.486637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411600.620652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411600.747075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411600.871939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411601.007953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411601.130024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411601.248439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411601.379678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411601.501278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411601.623546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411601.752998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411601.893542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411602.013238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411602.142509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411602.276079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411602.426893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411602.550992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411602.678541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411602.802993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411602.930157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411603.060539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411603.185591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411603.316502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411603.443385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411603.576097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411603.686285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411603.820729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411603.956592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411604.081894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411604.227868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411604.360684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411604.502436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411604.626515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411604.746676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411604.877644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411605.003376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411605.127679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411605.258183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411605.380553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411605.505324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411605.640743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411605.779286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411605.891322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411606.042248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411606.159130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411606.303221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411606.423702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411606.559176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411606.689976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411606.820276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411606.944813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411607.079801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411607.213918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411607.370226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411607.489052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411607.623078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411607.741716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411607.884640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411608.007571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411608.150022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411608.293499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411608.441056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411608.546271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411608.673695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411608.803956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411608.938005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411609.063242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411609.191674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411609.316225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411609.444119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411609.573716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411609.698927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411609.825475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411609.964148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411610.096993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411610.233028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411610.366667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411610.490105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411610.620667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411610.749527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411610.875354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411611.005027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411611.126633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411611.254930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411611.378708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411611.515865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411611.625355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411611.794506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411611.906005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411612.027321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411612.169610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411612.310685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411612.426895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411612.580607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411612.686021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411612.806103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411612.949643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411613.061406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411613.205207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411613.325786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411613.464105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411613.582932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411613.698199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411613.854737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411613.993693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411614.116392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411614.244725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411614.375471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411614.490379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411614.620036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411614.766791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411614.878973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411615.019871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411615.128215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411615.251256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411615.371485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411615.498109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411615.624431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411615.749516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411615.875921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411616.003087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411616.142390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411616.266984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411616.396201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411616.518496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411616.660216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411616.776178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411616.925491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411617.049407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411617.179730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411617.300205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411617.423878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411617.557849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411617.679424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411617.803553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411617.927754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411618.063001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411618.190237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411618.330498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411618.436779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411618.559911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411618.686463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411618.827340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411618.937768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411619.099758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411619.216071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411619.339077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411619.484890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411619.618086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411619.743803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411619.878224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411620.003536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411620.132510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411620.271226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411620.407540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411620.537108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411620.663991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411620.807906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411620.938595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411621.079673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411621.190621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411621.317806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411621.444350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411621.578808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411621.699407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411621.828567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411621.958591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411622.082949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411622.227875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411622.358221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411622.500768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411622.617554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411622.743780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411622.872465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411622.997958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411623.124865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411623.258496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411623.382023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411623.498083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411623.628892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411623.751842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411623.888236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411623.998599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411624.132559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411624.250040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411624.377567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411624.505844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411624.642100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411624.756002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411624.884437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411625.019742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411625.135368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411625.269219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411625.415498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411625.533240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411625.677916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411625.796753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411625.934094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411626.053248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411626.187293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411626.306880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411626.441996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411626.563139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411626.686348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411626.811543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411626.939584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411627.072113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411627.186206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411627.319350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411627.438304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411627.564323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411627.692980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411627.821153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411627.952523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411628.082580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411628.221237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411628.353555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411628.501551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411628.615477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411628.749025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411628.887708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411629.005182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411629.145407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411629.268775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411629.396696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411629.527015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411629.646160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411629.793335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411629.912851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411630.039551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411630.168659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411630.306928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411630.431764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411630.558736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411630.686050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411630.807052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411630.947075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411631.083563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411631.187894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411631.309784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411631.436675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411631.563328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411631.686641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411631.818892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411631.954332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411632.079991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411632.219947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411632.361132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411632.496029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411632.624043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411632.765290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411632.889968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411632.995906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411633.115417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411633.246787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411633.375054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411633.505026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411633.629733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411633.773200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411633.901759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411634.020267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411634.143441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411634.274468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411634.408031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411634.546680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411634.680892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411634.807668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411634.939916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411635.060111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411635.187468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411635.313171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411635.442061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411635.560443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411635.685976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411635.812973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411635.941102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411636.063696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411636.191967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411636.319864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411636.453099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411636.576538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411636.704597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411636.843837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411636.956201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411637.087197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411637.214396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411637.353268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411637.484942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411637.619033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411637.748055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411637.873968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411638.013670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411638.142758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411638.269462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411638.396121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411638.522934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411638.683830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411638.810226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411638.946754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411639.048848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411639.200286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411639.317107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411639.439631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411639.564773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411639.687583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411639.821412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411639.950339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411640.083952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411640.215320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411640.356742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411640.478712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411640.605807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411640.730647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411640.871955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411640.996021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411641.144927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411641.247152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411641.378795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411641.502782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411641.628396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411641.767658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411641.909655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411642.034031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411642.176199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411642.300610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411642.433052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411642.555161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411642.681278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411642.803631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411642.929904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411643.055153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411643.187103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411643.308860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411643.451592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411643.565417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411643.717421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411643.829012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411643.962742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411644.085433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411644.228924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411644.361845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411644.494973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411644.615360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411644.741534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411644.861138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411644.995178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411645.114905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411645.287141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411645.407213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411645.535012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411645.668357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411645.801881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411645.924032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411646.056798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411646.197080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411646.315622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411646.436721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411646.562551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411646.689907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411646.819843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411646.937743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411647.105433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411647.221636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411647.351479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411647.474992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411647.620578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411647.760488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411647.874011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411648.006235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411648.142227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411648.269732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411648.398104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411648.538175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411648.667207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411648.803305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411648.927933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411649.057903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411649.194398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411649.318482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411649.441583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411649.571109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411649.695517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411649.818980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411649.953858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411650.082866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411650.224728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411650.352302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411650.485525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411650.609083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411650.736095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411650.868580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411651.006092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411651.111231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411651.264339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411651.374114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411651.506022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411651.631728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411651.758124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411651.896588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411652.021260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411652.144013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411652.268220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411652.400819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411652.538475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411652.667908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411652.809160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411652.935098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411653.063835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411653.182361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411653.315736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411653.437640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411653.557846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411653.695602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411653.810008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411653.959592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411654.070697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411654.210315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411654.336753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411654.472950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411654.608089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411654.734115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411654.866217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411654.995515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411655.116871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411655.250611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411655.373802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411655.499559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411655.640586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411655.765026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411655.915242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411656.045689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411656.168161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411656.305347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411656.425847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411656.559345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411656.677613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411656.810552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411656.947885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411657.055625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411657.179491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411657.313487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411657.456573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411657.567664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411657.698385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411657.820273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411657.958022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411658.104419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411658.226305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411658.367568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411658.495469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411658.616203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411658.750884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411658.876286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411659.017573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411659.122612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411659.242736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411659.376536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411659.515588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411659.664267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411659.797199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411659.924066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411660.058892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411660.180514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411660.312819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411660.445243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411660.569027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411660.694274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411660.822785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411660.956334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411661.088818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411661.209480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411661.338005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411661.477979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411661.602534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411661.743424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411661.877685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411662.002039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411662.132617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411662.256263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411662.381594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411662.506300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411662.632608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411662.756906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411662.883861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411663.014634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411663.135743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411663.265678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411663.391945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411663.518877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411663.644309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411663.790555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411663.926119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411664.061193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411664.172527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411664.297949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411664.435631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411664.548681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411664.680718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411664.809864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411664.936842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411665.067565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411665.192206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411665.307890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411665.452566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411665.579437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411665.696418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411665.810963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411665.939981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411666.063505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411666.192613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411666.317906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411666.445364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411666.569566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411666.695479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411666.820048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411666.952225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411667.079732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411667.206211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411667.330733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411667.470331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411667.589130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411667.742201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411667.863355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411667.995301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411668.122499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411668.248588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411668.372635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411668.497298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411668.624226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411668.751400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411668.881574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411669.006604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411669.142391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411669.282159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411669.413836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411669.555127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411669.680528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411669.809372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411669.935230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411670.075975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411670.185709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411670.321245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411670.442232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411670.567605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411670.701480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411670.820832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411670.955488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411671.087620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411671.224901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411671.353715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411671.484840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411671.615851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411671.754216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411671.895456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411672.017332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411672.145865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411672.278964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411672.414616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411672.558594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411672.676216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411672.804809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411672.925695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411673.054840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411673.188541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411673.300092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411673.428939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411673.558641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411673.685416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411673.810654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411673.938379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411674.064944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411674.206286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411674.330712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411674.470419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411674.580963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411674.727616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411674.855901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411674.974981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411675.108359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411675.245462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411675.371902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411675.516290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411675.629755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411675.759258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411675.880837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411676.023921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411676.142773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411676.269681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411676.407288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411676.519505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411676.661819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411676.800548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411676.920789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411677.042130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411677.182068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411677.301142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411677.432602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411677.555513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411677.682559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411677.809320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411677.934953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411678.069983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411678.194612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411678.322806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411678.455521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411678.600384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411678.731188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411678.845821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411678.983242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411679.123697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411679.241048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411679.371948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411679.490130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411679.622073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411679.747399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411679.875972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411680.002767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411680.130053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411680.258119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411680.388068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411680.518432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411680.660898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411680.771004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411680.916296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411681.041753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411681.164625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411681.319732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411681.434030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411681.559077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411681.680744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411681.811947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411681.938117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411682.069694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411682.193299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411682.317883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411682.448933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411682.582474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411682.704283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411682.842489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411682.978426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411683.111536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411683.244136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411683.355441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411683.497486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411683.612440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411683.748199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411683.868305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411684.013272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411684.123019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411684.248964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411684.378928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411684.513121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411684.649269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411684.772907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411684.914904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411685.047159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411685.166929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411685.304117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411685.429003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411685.560193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411685.704000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411685.836836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411685.943983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411686.070803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411686.201121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411686.328580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411686.455608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411686.598615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411686.728182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411686.869287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411687.000453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411687.115386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411687.243666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411687.370820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411687.489075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411687.621560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411687.748259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411687.876756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411688.006908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411688.125709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411688.244678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411688.375345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411688.504153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411688.632179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411688.754901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411688.883838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411689.014647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411689.142536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411689.268419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411689.407792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411689.543303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411689.679509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411689.805828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411689.933862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411690.062493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411690.191111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411690.322728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411690.458210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411690.563372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411690.691891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411690.817019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411690.941702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411691.084223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411691.205227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411691.329177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411691.455865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411691.580974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411691.723209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411691.867757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411691.992541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411692.125551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411692.255258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411692.375542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411692.494696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411692.628754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411692.753929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411692.890469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411693.010529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411693.135911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411693.276255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411693.412993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411693.544113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411693.644977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411693.789513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411693.917026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411694.061657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411694.180930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411694.311074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411694.428006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411694.552098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411694.683433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411694.823389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411694.927735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411695.066485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411695.187766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411695.312437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411695.435549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411695.561152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411695.678196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411695.805669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411695.936129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411696.055109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411696.180083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411696.308823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411696.425941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411696.562218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411696.690021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411696.811916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411696.934753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411697.063550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411697.190496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411697.315844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411697.442641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411697.564162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411697.689533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411697.828093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411698.079232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411698.350853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411698.692243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411699.069973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411699.241180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411699.436480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411699.681684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411699.858155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411700.067695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411700.295901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411700.480611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411700.667341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411700.839658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411701.020518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411701.179471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411701.389770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411701.569917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411701.759614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411701.951167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411702.133969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411702.300684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411702.504448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411702.633397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411702.937097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411703.052995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411703.185984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411703.332920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411703.545615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411703.686273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411703.888534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411704.097573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411704.255854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411704.459643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411704.599812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411704.792629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411705.002040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411705.155545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411705.367126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411705.618307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411705.848927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411705.956851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411706.103567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411706.220914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411706.353546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411706.498609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411706.621557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411706.748760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411706.874068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411706.994559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411707.125477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411707.248789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411707.377813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411707.514425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411707.628830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411707.766553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411707.899695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411708.036282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411708.177100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411708.295796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411708.431328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411708.591707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411708.808955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411708.927123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411709.057535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411709.186487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411709.312410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411709.427835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411709.560281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411709.686594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411709.833289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411709.959713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411710.082722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411710.227673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411710.369447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411710.491839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411710.612612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411710.738465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411710.884579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411711.001200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411711.130169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411711.253838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411711.382939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411711.516896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411711.655484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411711.782414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411711.915620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411712.054446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411712.189263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411712.319451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411712.438107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411712.559915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411712.702348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411712.810834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411712.938041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411713.057792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411713.184707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411713.325606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411713.441852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411713.561129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411713.697808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411713.850241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411713.973260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411714.101722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411714.243151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411714.362743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411714.511643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411714.620004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411714.747807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411714.876157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411715.012448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411715.137477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411715.282754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411715.397245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411715.531543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411715.666219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411715.814780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411715.941446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411716.077155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411716.207134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411716.349893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411716.481956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411716.631755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411716.746560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411716.871138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411716.995932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411717.138925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411717.252369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411717.395206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411717.514129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411717.635205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411717.763335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411717.897262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411718.029815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411718.176188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411718.303291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411718.435179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411718.557470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411718.685954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411718.813279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411718.959171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411719.081046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411719.192701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411719.316326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411719.453912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411719.569577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411719.694458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411719.821067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411719.951938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411720.092395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411720.224172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411720.355042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411720.495407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411720.623858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411720.752516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411720.878291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411721.007604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411721.130571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411721.263692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411721.391156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411721.529279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411721.671688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411721.810527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411721.930725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411722.062478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411722.189163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411722.316907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411722.447460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411722.587246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411722.724007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411722.864164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411722.983952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411723.108917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411723.235934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411723.359559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411723.489645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411723.630182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411723.745836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411723.875308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411724.005433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411724.127587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411724.253205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411724.378272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411724.498346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411724.650451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411724.765955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411724.883362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411725.014018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411725.136763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411725.265997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411725.397856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411725.534879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411725.676590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411725.807853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411725.935655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411726.060940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411726.187707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411726.349782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411726.485189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411726.604119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411726.733046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411726.864308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411727.013543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411727.116664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411727.257746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411727.391825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411727.511356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411727.639411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411727.781169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411727.891762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411728.035017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411728.164943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411728.303083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411728.435033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411728.565987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411728.694010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411728.845032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411728.951805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411729.085925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411729.220886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411729.359508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411729.490557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411729.623007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411729.744491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411729.870382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411729.999796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411730.151909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411730.259357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411730.393652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411730.534806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411730.666320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411730.800398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411730.936971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411731.063827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411731.188081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411731.316757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411731.466596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411731.575335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411731.737607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411731.861425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411731.991528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411732.115717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411732.247014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411732.370472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411732.502202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411732.628354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411732.756729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411732.872887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411733.003435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411733.128752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411733.261898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411733.389838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411733.515225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411733.640285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411733.783272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411733.914626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411734.055705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411734.170204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411734.304225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411734.425684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411734.553812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411734.678376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411734.816982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411734.934214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411735.055960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411735.183185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411735.315023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411735.431232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411735.578605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411735.686383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411735.819367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411735.936262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411736.067150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411736.181347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411736.313478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411736.435560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411736.564248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411736.691823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411736.810413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411736.935343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411737.077204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411737.201122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411737.337399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411737.473569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411737.608803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411737.737602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411737.866535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411737.990902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411738.119661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411738.237233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411738.367085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411738.500713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411738.615911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411738.759698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411738.877206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411739.009415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411739.129663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411739.258615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411739.386506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411739.511450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411739.660176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411739.780252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411739.921052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411740.053122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411740.180850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411740.299891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411740.433660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411740.551000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411740.681339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411740.824584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411740.951540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411741.066204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411741.204630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411741.340408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411741.473292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411741.604582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411741.731894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411741.866028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411741.999923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411742.122201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411742.254302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411742.378093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411742.521453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411742.649081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411742.801059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411742.911418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411743.059633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411743.179991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411743.301512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411743.432555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411743.559130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411743.682306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411743.816050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411743.939287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411744.068329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411744.207540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411744.335417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411744.481571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411744.605042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411744.738181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411744.876009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411744.995376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411745.122769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411745.245584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411745.404432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411745.521717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411745.659502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411745.801097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411745.922881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411746.050382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411746.184729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411746.307379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411746.434794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411746.554853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411746.682409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411746.805567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411746.932942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411747.054142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411747.182742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411747.310754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411747.451636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411747.564286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411747.692670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411747.831486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411747.961870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411748.096990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411748.228692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411748.366714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411748.514078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411748.624779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411748.743921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411748.875845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411749.006774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411749.140267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411749.277429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411749.400853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411749.559971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411749.682762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411749.827781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411749.925504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411750.065464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411750.187874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411750.316608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411750.441696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411750.576169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411750.722542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411750.855441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411750.990507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411751.121013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411751.243236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411751.370557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411751.494903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411751.642114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411751.750157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411751.876112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411752.004762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411752.130175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411752.251129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411752.376693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411752.503330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411752.645498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411752.768160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411752.898002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411753.031175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411753.160407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411753.287821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411753.413861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411753.535161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411753.684304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411753.800971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411753.924478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411754.045064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411754.180270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411754.302480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411754.424633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411754.561036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411754.692031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411754.814900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411754.944114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411755.076219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411755.198316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411755.321102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411755.452350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411755.584529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411755.729757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411755.869022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411755.991189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411756.119242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411756.251865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411756.381031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411756.504824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411756.626996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411756.758752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411756.879924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411757.018268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411757.141275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411757.272848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411757.409641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411757.556859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411757.673355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411757.813612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411757.934703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411758.066138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411758.183104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411758.310929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411758.433863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411758.564737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411758.702553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411758.816554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411758.951884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411759.163580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411759.310394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411759.441372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411759.586329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411759.693559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411759.851627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411759.986620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411760.109976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411760.247582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411760.369987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411760.502627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411760.630975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411760.752922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411760.886037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411761.015216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411761.144345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411761.304458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411761.428150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411761.552337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411761.681951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411761.834640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411761.969546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411762.116426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411762.247122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411762.363247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411762.485951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411762.618411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411762.742596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411762.886651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411762.984526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411763.119415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411763.244092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411763.375119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411763.499546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411763.632412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411763.763115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411763.907584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411764.033852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411764.192569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411764.301881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411764.440776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411764.568841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411764.686078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411764.810892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411764.939028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411765.086162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411765.199517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411765.343574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411765.455287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411765.603780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411765.726083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411765.861867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411765.998265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411766.124149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411766.250734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411766.378109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411766.507999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411766.643196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411766.765713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411766.907154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411767.046699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411767.165495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411767.291070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411767.425685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411767.557218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411767.691000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411767.814804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411767.934876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411768.063672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411768.201987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411768.313555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411768.428062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411768.564009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411768.685115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411768.808761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411768.938943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411769.074521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411769.200935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411769.340488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411769.472470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411769.600121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411769.731808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411769.890288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411770.012949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411770.139363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411770.265518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411770.412455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411770.545668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411770.699557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411770.799218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411770.935260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411771.046539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411771.181427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411771.304533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411771.450202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411771.556638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411771.687673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411771.814508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411771.946255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411772.072135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411772.208602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411772.340541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411772.477170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411772.600841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411772.725079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411772.863154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411772.997432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411773.108357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411773.242057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411773.363343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411773.494115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411773.616034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411773.744386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411773.874310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411773.997714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411774.129015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411774.247659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411774.371523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411774.495320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411774.635149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411774.748973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411774.876348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411775.009857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411775.121025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411775.255821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411775.376401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411775.510509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411775.637719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411775.773171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411775.933578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411776.061559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411776.182739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411776.313716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411776.436492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411776.560535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411776.698084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411776.829251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411776.935422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411777.070702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411777.207869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411777.347167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411777.458353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411777.598087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411777.731742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411777.867441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411777.998441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411778.125464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411778.247731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411778.375226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411778.499134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411778.639468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411778.763773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411778.890450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411779.016952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411779.163150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411779.286634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411779.430068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411779.545583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411779.677313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411779.796347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411779.935033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411780.059472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411780.184476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411780.314709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411780.453072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411780.575428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411780.700515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411780.832403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411780.973546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411781.098714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411781.256798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411781.365947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411781.486173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411781.630612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411781.748041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411781.878499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411782.015732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411782.148174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411782.272298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411782.431948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411782.554294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411782.676435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411782.817651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411782.932883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411783.059873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411783.187160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411783.308209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411783.448435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411783.568560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411783.694206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411783.831234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411783.948097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411784.112104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411784.226429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411784.363511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411784.503475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411784.614563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411784.734469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411784.880837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411784.994829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411785.125510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411785.252167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411785.412024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411785.534326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411785.664340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411785.791951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411785.929507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411786.054962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411786.194609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411786.434671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411786.613776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411786.747622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411786.872854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411787.011353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411787.135521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411787.280290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411787.405333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411787.549164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411787.668298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411787.805434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411787.930336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411788.060706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411788.187586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411788.316639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411788.457913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411788.576601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411788.703223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411788.837300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411788.978588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411789.107742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411789.246129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411789.375325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411789.496428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411789.624246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411789.749678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411789.877202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411790.004909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411790.147114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411790.267678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411790.407448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411790.535324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411790.682912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411790.808026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411790.951147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411791.060342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411791.207713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411791.303152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411791.431528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411791.563685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411791.691287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411791.863315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411791.982829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411792.117304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411792.246232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411792.360062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411792.495499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411792.619603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411792.743740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411792.871357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411793.012785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411793.119626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411793.244947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411793.373440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411793.502946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411793.628692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411793.762220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411793.896795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411794.036504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411794.164474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411794.325538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411794.432512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411794.560068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411794.681297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411794.808684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411794.931432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411795.056231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411795.180020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411795.310946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411795.436908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411795.565704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411795.690863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411795.838824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411795.960556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411796.092827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411796.233704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411796.374057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411796.486356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411796.626218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411796.741331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411796.873873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411797.010283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411797.122708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411797.249363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411797.368098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411797.492007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411797.620084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411797.754699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411797.890266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411797.998422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411798.128522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411798.254295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411798.388355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411798.519069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411798.664424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411798.803705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411798.926149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411799.057840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411799.184094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411799.305675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411799.431979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411799.562847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411799.683213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411799.812501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411799.945252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411800.068347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411800.205646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411800.347238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411800.468859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411800.615045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411800.726148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411800.868485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411800.997247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411801.124502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411801.249062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411801.379952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411801.512690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411801.636094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411801.770186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411801.909410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411802.028776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411802.175228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411802.293708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411802.425356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411802.567064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411802.678553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411802.822661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411802.925889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411803.054749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411803.175482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411803.305007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411803.431193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411803.561409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411803.678420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411803.813645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411803.936780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411804.062810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411804.185944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411804.314969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411804.435958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411804.578620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411804.699073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411804.825367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411804.973323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411805.116462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411805.238889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411805.364859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411805.491573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411805.619565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411805.733944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411805.862394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411805.991474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411806.127837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411806.241615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411806.381036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411806.511031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411806.648823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411806.761573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411806.909053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411807.035532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411807.175987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411807.300010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411807.443991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411807.550291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411807.670833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411807.807712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411807.921417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411808.045095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411808.172897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411808.297110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411808.423914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411808.551739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411808.680543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411808.805617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411808.933282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411809.075665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411809.183412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411809.304591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411809.433875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411809.553830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411809.683700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411809.805452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411809.933201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411810.060026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411810.187104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411810.312681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411810.443098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411810.566308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411810.698257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411810.817719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411810.953613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411811.097543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411811.235530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411811.358395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411811.483378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411811.614055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411811.755577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411811.882338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411812.013156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411812.145766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411812.280785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411812.408270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411812.540317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411812.665567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411812.793343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411812.926917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411813.051667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411813.179350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411813.325988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411813.437544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411813.562519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411813.679817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411813.804661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411813.923837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411814.052476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411814.176273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411814.308901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411814.427948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411814.548797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411814.683578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411814.809233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411814.952903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411815.064437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411815.190352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411815.324725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411815.459424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411815.582570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411815.722220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411815.850892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411815.986629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411816.120408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411816.240396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411816.368726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411816.493875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411816.624724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411816.746398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411816.888529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411816.999517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411817.128283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411817.252522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411817.386507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411817.515020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411817.651894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411817.780997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411817.932042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411818.050419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411818.181098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411818.328496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411818.468839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411818.699439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411819.078726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411819.422638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411819.752405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411819.899953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411820.115931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411820.325720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411820.547794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411820.718763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411820.872496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411821.036913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411821.245659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411821.430079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411821.600548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411821.766839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411821.971957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411822.175513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411822.318284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411822.519383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411822.696517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411822.868955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411823.050929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411823.196498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411823.480063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411823.667372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411823.808995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411823.941199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411824.110462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411824.266254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411824.433044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411824.622064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411824.788345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411824.951696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411825.119255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411825.286451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411825.453495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411825.625231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411825.823262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411825.954601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411826.127264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411826.403447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411826.626531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411826.779042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411826.924560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411827.052888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411827.176926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411827.308755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411827.452480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411827.555839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411827.687731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411827.817833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411827.946428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411828.071875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411828.204602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411828.332258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411828.476306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411828.599053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411828.724909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411828.855572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411828.997021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411829.115877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411829.264447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411829.479747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411829.644485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411829.771235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411829.906369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411830.041533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411830.161636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411830.305515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411830.423752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411830.554101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411830.678438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411830.808750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411830.931024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411831.059517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411831.180285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411831.305095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411831.435506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411831.561118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411831.698082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411831.810701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411831.932032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411832.056776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411832.200372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411832.313898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411832.439490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411832.567249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411832.691677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411832.823856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411832.951330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411833.090981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411833.212699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411833.376732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411833.482661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411833.626910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411833.745238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411833.870723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411834.003940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411834.138933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411834.264209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411834.397873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411834.537568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411834.678445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411834.795151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411834.921326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411835.050054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411835.172863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411835.301341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411835.422519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411835.554862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411835.679696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411835.813111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411835.955972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411836.071101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411836.199427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411836.324295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411836.461870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411836.595490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411836.727308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411836.861846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411836.990021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411837.114703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411837.252564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411837.370541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411837.515092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411837.627868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411837.760049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411837.877449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411838.004792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411838.127327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411838.255793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411838.386311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411838.526000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411838.645527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411838.769988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411838.897373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411839.025881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411839.158251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411839.284597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411839.425192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411839.556871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411839.681248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411839.814483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411839.925420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411840.064761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411840.183913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411840.315285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411840.443012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411840.570348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411840.695417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411840.825896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411840.951075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411841.084048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411841.211818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411841.340758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411841.470735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411841.614061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411841.737109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411841.858261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411841.984638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411842.109025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411842.246584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411842.367114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411842.496000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411842.618800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411842.738159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411842.885849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411842.993096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411843.121508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411843.248492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411843.399766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411843.524707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411843.660168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411843.789942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411843.918693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411844.043228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411844.168871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411844.296888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411844.426190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411844.550547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411844.699293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411844.822501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411844.957524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411845.081629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411845.201126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411845.312559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411845.447146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411845.571787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411845.701798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411845.838408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411845.982414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411846.117671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411846.250776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411846.357300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411846.492471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411846.616220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411846.738698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411846.874702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411846.992336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411847.116083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411847.235470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411847.365077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411847.494425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411847.619021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411847.741108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411847.868570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411848.001744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411848.118936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411848.246132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411848.372573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411848.509911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411848.635435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411848.769292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411848.884633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411849.029248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411849.162388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411849.305598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411849.428679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411849.555070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411849.679258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411849.823949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411849.928658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411850.051240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411850.190541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411850.316862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411850.445587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411850.580948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411850.714804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411850.849073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411850.975894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411851.127021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411851.236249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411851.365456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411851.492278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411851.624234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411851.747133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411851.886230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411852.018645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411852.158274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411852.288308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411852.415230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411852.559005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411852.671281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411852.799168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411852.948949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411853.052015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411853.184502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411853.306152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411853.435473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411853.560842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411853.697931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411853.834323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411853.970667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411854.099947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411854.224938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411854.366047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411854.496716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411854.618224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411854.748266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411854.875776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411855.001333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411855.122293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411855.264263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411855.380115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411855.510283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411855.656260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411855.782764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411855.910738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411856.047940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411856.172947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411856.297313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411856.419644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411856.553855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411856.674460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411856.807758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411856.932485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411857.056988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411857.200548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411857.327853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411857.437160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411857.552168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411857.687030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411857.811064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411857.935915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411858.061368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411858.186062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411858.322930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411858.442487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411858.573639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411858.717561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411858.854579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411858.982213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411859.109510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411859.233973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411859.363863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411859.486628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411859.616276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411859.740656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411859.871586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411859.997817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411860.126738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411860.242172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411860.370508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411860.498696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411860.625924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411860.753761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411860.886125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411861.005162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411861.149171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411861.284132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411861.413759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411861.542485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411861.672411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411861.793138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411861.926496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411862.045076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411862.172920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411862.295900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411862.430016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411862.542801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411862.670849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411862.792394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411862.936327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411863.049369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411863.172694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411863.294044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411863.429463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411863.559301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411863.674241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411863.810707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411863.937258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411864.062562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411864.188068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411864.312135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411864.441780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411864.573681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411864.727145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411864.859129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411864.991590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411865.117628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411865.240967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411865.365162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411865.496723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411865.613791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411865.735944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411865.862616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411865.994627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411866.115918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411866.246953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411866.368917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411866.491506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411866.608109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411866.737529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411866.861838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411866.992582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411867.108020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411867.238492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411867.359693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411867.491982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411867.615398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411867.734527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411867.858697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411867.993178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411868.115356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411868.244114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411868.371823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411868.500899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411868.627923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411868.761778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411868.890062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411869.030337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411869.166709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411869.304451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411869.425676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411869.543230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411869.676298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411869.805628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411869.926040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411870.051581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411870.179305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411870.308162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411870.426990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411870.559409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411870.685171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411870.819426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411870.936481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411871.061263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411871.187421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411871.314807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411871.443605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411871.581481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411871.697585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411871.839606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411871.973533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411872.113651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411872.235890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411872.369226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411872.508673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411872.664322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411872.776573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411872.916641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411873.027741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411873.180535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411873.297656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411873.432513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411873.552362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411873.681009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411873.802130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411873.933860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411874.066959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411874.197644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411874.325861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411874.449964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411874.580989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411874.734858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411874.848752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411874.976234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411875.103335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411875.229946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411875.369954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411875.491354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411875.616970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411875.739142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411875.885130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411875.994912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411876.120593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411876.263053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411876.376920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411876.499537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411876.630446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411876.765075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411876.887027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411877.019820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411877.166731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411877.283302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411877.423156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411877.554830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411877.668557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411877.802852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411877.928526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411878.055533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411878.175215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411878.301413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411878.424126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411878.559547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411878.681127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411878.821374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411878.937553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411879.057214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411879.194365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411879.321636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411879.429348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411879.564499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411879.681813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411879.820675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411879.964092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411880.086930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411880.219541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411880.349991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411880.480327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411880.629525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411880.746470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411880.873914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411881.010594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411881.134107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411881.247984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411881.370485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411881.503388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411881.642239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411881.763786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411881.929248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411882.051991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411882.182837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411882.301727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411882.430336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411882.553312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411882.681517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411882.810637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411882.946890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411883.055700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411883.180410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411883.306117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411883.436458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411883.574224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411883.683785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411883.822132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411883.994696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411884.116225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411884.247573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411884.367371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411884.493761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411884.622535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411884.746518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411884.875773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411885.002267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411885.142962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411885.254945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411885.377465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411885.512592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411885.635191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411885.764013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411885.888762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411886.018752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411886.158417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411886.299700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411886.419754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411886.545107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411886.668385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411886.807269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411886.948267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411887.070336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411887.210645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411887.324763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411887.457733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411887.587021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411887.720003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411887.865276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411887.989765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411888.120018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411888.243549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411888.367431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411888.491659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411888.617974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411888.738940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411888.872628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411888.995872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411889.125937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411889.277667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411889.387577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411889.517249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411889.640116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411889.768938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411889.926432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411890.041977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411890.182082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411890.306412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411890.447912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411890.561447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411890.696103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411890.815982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411890.962864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411891.097068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411891.215881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411891.345098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411891.491244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411891.615538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411891.736253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411891.884115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411891.992596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411892.116009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411892.237966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411892.362057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411892.491047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411892.614341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411892.739486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411892.868411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411892.991246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411893.117183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411893.244117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411893.379582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411893.514231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411893.628842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411893.774844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411893.908209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411894.025152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411894.154846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411894.285856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411894.424782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411894.555847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411894.684698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411894.807600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411894.928805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411895.056525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411895.179492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411895.305352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411895.435147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411895.560408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411895.684327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411895.829693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411895.965014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411896.102793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411896.242387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411896.361334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411896.490202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411896.615622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411896.742996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411896.868121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411896.991698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411897.129569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411897.254179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411897.375092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411897.499198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411897.626181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411897.747551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411897.874714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411897.996957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411898.132741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411898.252380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411898.389894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411898.523599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411898.636449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411898.773612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411898.909845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411899.047660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411899.176589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411899.299547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411899.432062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411899.575188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411899.684418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411899.811074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411899.943517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411900.070465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411900.212304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411900.328844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411900.463111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411900.598538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411900.737137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411900.853636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411900.989348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411901.106813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411901.241250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411901.364794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411901.496399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411901.634539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411901.744941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411901.872883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411902.007744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411902.136055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411902.258115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411902.377883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411902.512211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411902.641128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411902.781652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411902.910731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411903.032181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411903.166705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411903.308126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411903.440449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411903.549208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411903.677831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411903.801874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411903.948185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411904.063378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411904.186504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411904.326708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411904.448882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411904.594408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411904.721587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411904.848288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411904.976579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411905.114266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411905.238292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411905.368731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411905.509921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411905.625932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411905.753368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411905.902871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411906.008135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411906.138414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411906.265731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411906.425030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411906.534494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411906.664726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411906.794518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411906.916641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411907.038181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411907.166970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411907.289983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411907.419536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411907.559481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411907.672447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411907.814285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411907.929878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411908.062234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411908.186320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411908.305650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411908.431152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411908.572119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411908.681321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411908.807709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411908.936164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411909.066091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411909.189784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411909.324455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411909.449354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411909.586954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411909.721566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411909.859190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411909.974451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411910.105962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411910.226722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411910.362329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411910.495317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411910.610830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411910.733571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411910.867351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411910.993435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411911.117859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411911.248346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411911.366078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411911.510675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411911.618197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411911.751819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411911.890059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411912.037819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411912.154679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411912.293632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411912.428433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411912.543994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411912.668875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411912.802398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411912.923842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411913.055374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411913.178379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411913.315298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411913.432033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411913.557496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411913.684086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411913.812296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411913.935427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411914.072175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411914.185012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411914.328780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411914.430551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411914.564842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411914.685300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411914.823598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411914.948488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411915.078457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411915.204561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411915.351114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411915.472403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411915.621249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411915.740475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411915.866515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411916.007857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411916.116634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411916.259377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411916.368482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411916.491434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411916.632091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411916.740496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411916.872650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411916.986759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411917.121575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411917.249530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411917.367406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411917.490348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411917.634480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411917.756269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411917.867101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411917.999056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411918.137701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411918.261823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411918.392021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411918.509613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411918.657619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411918.791915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411918.925115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411919.056955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411919.177489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411919.293550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411919.428478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411919.541836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411919.679224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411919.794652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411919.938297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411920.059988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411920.186284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411920.317770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411920.443295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411920.569831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411920.711127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411920.828018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411920.967587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411921.094962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411921.234394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411921.354441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411921.485651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411921.604884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411921.743680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411921.864859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411921.991043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411922.117620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411922.262000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411922.375287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411922.499675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411922.616064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411922.746423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411922.870391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411922.987238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411923.119123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411923.261911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411923.374329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411923.512848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411923.651894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411923.780662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411923.911126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411924.046476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411924.194960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411924.312180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411924.433653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411924.559546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411924.686777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411924.823179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411924.947950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411925.082477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411925.214658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411925.361173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411925.470071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411925.607104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411925.719915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411925.842105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411925.974710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411926.112056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411926.253820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411926.384991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411926.488292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411926.618878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411926.740579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411926.870975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411926.995871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411927.132423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411927.259285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411927.406352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411927.541760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411927.680592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411927.793428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411927.927501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411928.054836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411928.186950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411928.314347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411928.433845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411928.556664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411928.687633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411928.806610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411928.964517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411929.082746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411929.218672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411929.357111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411929.493333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411929.602899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411929.724099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411929.858312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411929.990008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411930.117029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411930.243860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411930.376277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411930.500582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411930.626229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411930.753661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411930.879925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411931.032173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411931.147016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411931.276402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411931.406945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411931.534140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411931.660362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411931.784480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411931.922283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411932.056611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411932.175340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411932.312494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411932.427711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411932.555918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411932.682965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411932.807756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411932.929260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411933.063225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411933.183525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411933.311915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411933.435020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411933.564230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411933.690251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411933.819642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411933.945160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411934.089039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411934.222872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411934.364841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411934.486007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411934.617545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411934.737033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411934.869225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411934.999011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411935.127786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411935.258619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411935.375863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411935.503232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411935.628851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411935.757614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411935.891120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411936.017112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411936.145761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411936.283234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411936.416200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411936.552858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411936.678370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411936.800604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411936.929232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411937.046893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411937.179472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411937.299028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411937.428039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411937.549826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411937.678643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411937.809296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411937.934211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411938.060690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411938.197354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411938.304487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411938.434461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411938.591372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411938.724314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411938.848619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411939.000207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411939.290082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411939.592848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411940.157641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411940.326744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411940.619840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411940.815305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411940.978906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411941.139596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411941.284442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411941.486362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411941.656712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411941.870688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411942.042053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411942.201684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411942.372937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411942.560625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411942.730203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411942.902006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411943.069198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411943.284188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411943.439692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411943.621161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411943.795856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411944.006207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411944.239050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411944.372889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411944.520839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411944.684919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411944.829230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411945.023051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411945.199663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411945.367824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411945.552552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411945.731463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411945.885969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411946.074318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411946.245295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411946.415050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411946.598713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411946.750329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411947.051480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411947.247170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411947.420619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411947.536750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411947.664936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411947.801944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411947.933734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411948.058786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411948.187706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411948.311169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411948.445330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411948.570911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411948.705832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411948.841155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411948.967881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411949.104333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411949.240280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411949.353831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411949.493167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411949.622032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411949.745471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411949.868111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411950.006281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411950.240674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411950.397263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411950.515673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411950.659306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411950.780763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411950.920627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411951.048174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411951.174994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411951.308199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411951.435682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411951.557283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411951.682596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411951.808395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411951.944746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411952.053128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411952.176735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411952.302526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411952.421072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411952.550221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411952.670978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411952.808799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411952.931673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411953.060285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411953.179779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411953.303173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411953.448413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411953.557883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411953.682436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411953.815375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411953.944116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411954.064892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411954.196225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411954.343002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411954.468192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411954.595108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411954.726828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411954.863486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411954.985194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411955.107759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411955.241291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411955.385334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411955.520576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411955.653407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411955.810453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411955.929932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411956.058438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411956.180361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411956.304758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411956.436795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411956.564192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411956.698464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411956.828924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411956.966588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411957.093895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411957.221936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411957.361266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411957.491122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411957.609996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411957.756409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411957.865911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411957.994862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411958.151477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411958.259984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411958.405568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411958.529205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411958.665730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411958.796292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411958.923115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411959.068589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411959.173047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411959.306703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411959.429469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411959.559280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411959.688601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411959.838796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411959.943339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411960.090586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411960.212999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411960.350562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411960.479350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411960.610424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411960.736789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411960.883351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411960.999046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411961.111032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411961.240194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411961.380379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411961.497652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411961.622235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411961.743507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411961.874537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411961.999058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411962.145978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411962.267419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411962.398060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411962.529281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411962.673347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411962.794616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411962.927171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411963.048791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411963.179278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411963.298648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411963.425625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411963.545768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411963.695173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411963.801912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411963.945975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411964.077579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411964.205429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411964.327829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411964.463995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411964.587445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411964.719929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411964.851552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411964.979865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411965.114659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411965.242105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411965.367060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411965.490447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411965.621688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411965.757496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411965.885226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411966.008389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411966.139612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411966.279804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411966.424644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411966.534097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411966.652857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411966.783543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411966.925427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411967.052007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411967.182514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411967.311875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411967.444309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411967.594306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411967.695329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411967.846811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411967.968038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411968.105951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411968.229716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411968.365214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411968.487705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411968.611561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411968.751029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411968.859835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411968.979677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411969.113016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411969.237313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411969.363946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411969.487436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411969.613611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411969.740247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411969.867524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411969.985880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411970.120282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411970.235052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411970.363128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411970.489701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411970.613783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411970.750458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411970.868305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411971.001089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411971.128683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411971.250381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411971.379308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411971.507509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411971.639815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411971.793928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411971.933511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411972.061874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411972.195018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411972.324053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411972.450368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411972.576333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411972.732173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411972.869263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411972.975832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411973.114945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411973.237445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411973.367285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411973.488660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411973.610421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411973.737365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411973.871569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411974.009467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411974.134215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411974.285659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411974.398821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411974.534378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411974.659372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411974.802572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411974.928350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411975.055138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411975.178124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411975.297888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411975.418790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411975.539968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411975.674012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411975.797764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411975.916268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411976.047909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411976.171046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411976.298533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411976.425303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411976.549091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411976.676787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411976.803405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411976.927745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411977.052011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411977.185407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411977.311242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411977.430453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411977.549094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411977.673509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411977.819253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411977.941427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411978.072233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411978.191660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411978.323077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411978.447767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411978.602938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411978.724177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411978.870950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411978.986036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411979.111672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411979.241916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411979.370456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411979.492244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411979.620834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411979.742044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411979.887803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411979.997746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411980.140517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411980.255535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411980.391216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411980.520516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411980.693534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411980.793841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411980.916059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411981.042600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411981.175508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411981.303220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411981.429172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411981.568321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411981.682247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411981.806027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411981.935456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411982.070957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411982.197971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411982.318839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411982.446392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411982.576076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411982.703278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411982.847681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411982.972200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411983.110452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411983.244597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411983.369739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411983.499893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411983.633676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411983.778348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411983.902968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411984.041986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411984.161995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411984.292803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411984.423114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411984.541116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411984.672886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411984.799336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411984.920469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411985.055719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411985.184397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411985.306893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411985.429292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411985.554013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411985.684876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411985.820544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411985.941861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411986.064517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411986.188661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411986.340527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411986.467160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411986.591402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411986.721111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411986.864204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411986.981836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411987.104987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411987.242850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411987.365819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411987.485795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411987.616703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411987.736744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411987.869351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411987.993321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411988.117536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411988.256786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411988.382230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411988.498781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411988.632859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411988.755243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411988.887570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411989.014647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411989.156058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411989.288218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411989.420570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411989.539514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411989.669530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411989.798579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411989.942899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411990.050014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411990.175502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411990.298787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411990.425113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411990.548251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411990.677436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411990.802585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411990.931904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411991.055907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411991.202145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411991.318007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411991.444534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411991.586545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411991.706978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411991.843103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411991.980627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411992.105332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411992.234329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411992.352306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411992.481027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411992.602829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411992.727559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411992.850076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411992.983481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411993.104182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411993.233820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411993.361638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411993.509567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411993.617715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411993.744257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411993.868528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411993.994104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411994.119907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411994.257359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411994.362565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411994.496946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411994.616062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411994.747243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411994.871952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411995.004872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411995.121797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411995.251706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411995.387547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411995.516564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411995.635258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411995.778788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411995.901603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411996.037330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411996.160736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411996.294098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411996.411578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411996.546948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411996.669671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411996.791418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411996.916551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411997.045758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411997.169863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411997.299154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411997.427398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411997.555624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411997.682222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411997.805643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411997.931677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411998.062413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411998.187483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411998.315722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411998.444296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411998.563815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411998.695042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638411998.833847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411998.960084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411999.095224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411999.224064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411999.358281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411999.488014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411999.633684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411999.791276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638411999.916085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412000.040130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412000.174740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412000.347190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412000.498252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412000.622284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412000.759746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412000.896222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412001.045806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412001.172214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412001.294039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412001.426842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412001.553559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412001.679072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412001.814133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412001.965119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412002.102727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412002.227146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412002.368309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412002.505835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412002.622826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412002.746033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412002.868081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412003.023257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412003.135180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412003.253479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412003.397904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412003.522941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412003.653219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412003.798159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412003.928627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412004.067267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412004.176974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412004.299479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412004.444507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412004.553689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412004.681527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412004.824017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412004.940696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412005.073799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412005.199274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412005.333779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412005.460876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412005.590032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412005.735620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412005.862789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412005.990733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412006.110872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412006.245332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412006.372462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412006.498168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412006.622962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412006.750299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412006.882671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412007.016869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412007.152213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412007.293653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412007.418831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412007.544103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412007.668864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412007.804677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412007.933441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412008.061094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412008.197332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412008.326901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412008.461816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412008.602183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412008.735999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412008.865677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412008.988697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412009.109560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412009.241729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412009.363776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412009.490084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412009.618617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412009.753557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412009.889512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412010.025019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412010.156391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412010.288826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412010.416718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412010.543671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412010.676075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412010.795936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412010.930085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412011.053179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412011.182673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412011.303891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412011.440805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412011.580503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412011.696158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412011.826578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412011.970116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412012.090793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412012.222767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412012.347643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412012.478971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412012.608222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412012.740837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412012.861936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412012.991027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412013.117640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412013.243984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412013.365756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412013.495980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412013.631646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412013.739874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412013.867849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412013.994336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412014.125923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412014.248501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412014.382330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412014.531227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412014.652720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412014.812069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412014.925327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412015.060667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412015.181097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412015.306208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412015.423028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412015.552823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412015.680182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412015.831981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412015.959881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412016.087588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412016.241497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412016.352137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412016.483011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412016.615699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412016.729649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412016.861645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412016.986967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412017.115794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412017.256962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412017.378539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412017.500326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412017.640745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412017.758623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412017.881622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412018.023091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412018.163142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412018.301212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412018.429080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412018.554225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412018.681764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412018.809137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412018.951296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412019.062489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412019.196295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412019.323142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412019.464644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412019.587339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412019.728447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412019.852860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412020.005487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412020.118026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412020.245704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412020.365839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412020.492536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412020.632419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412020.776903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412020.882984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412021.031828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412021.153159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412021.289840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412021.408857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412021.548369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412021.672385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412021.800840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412021.927495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412022.055114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412022.178592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412022.302935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412022.424071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412022.555963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412022.677181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412022.806072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412022.936122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412023.067686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412023.196467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412023.318885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412023.458977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412023.579678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412023.726743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412023.854778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412023.982726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412024.118439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412024.241786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412024.368022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412024.487632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412024.616372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412024.744337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412024.869509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412024.985228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412025.120263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412025.242978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412025.370658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412025.495943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412025.630490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412025.749946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412025.885859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412026.020699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412026.163239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412026.285079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412026.406224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412026.540645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412026.663787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412026.783112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412026.915589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412027.069117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412027.231901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412027.345637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412027.479008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412027.598941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412027.740029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412027.878674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412027.993735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412028.116170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412028.244041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412028.382976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412028.504356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412028.621756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412028.765706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412028.884764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412029.033523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412029.146195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412029.278187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412029.412979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412029.552103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412029.673601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412029.795833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412029.922364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412030.043147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412030.164016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412030.299647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412030.420998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412030.549911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412030.672976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412030.803585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412030.924971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412031.054411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412031.176960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412031.306205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412031.431598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412031.565453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412031.691191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412031.813265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412031.957685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412032.102349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412032.237973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412032.369415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412032.475794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412032.629616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412032.733081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412032.865315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412032.990939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412033.113585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412033.231052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412033.361072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412033.487722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412033.614282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412033.746030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412033.867431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412033.991816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412034.122458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412034.246651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412034.393806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412034.513855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412034.650329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412034.779155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412034.907045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412035.042592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412035.171255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412035.292972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412035.424024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412035.561343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412035.678319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412035.816385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412035.933221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412036.070507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412036.185308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412036.317667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412036.450620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412036.574793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412036.719094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412036.843421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412036.978163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412037.108246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412037.232224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412037.360558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412037.490995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412037.637981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412037.757194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412037.886714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412038.014767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412038.152358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412038.286659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412038.414250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412038.550657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412038.674021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412038.804410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412038.919152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412039.045088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412039.172627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412039.301900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412039.425100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412039.550672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412039.700717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412039.828619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412039.956171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412040.071806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412040.207843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412040.338691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412040.478122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412040.610065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412040.739178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412040.877628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412040.987813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412041.112540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412041.254341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412041.362089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412041.482862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412041.630970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412041.742973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412041.859780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412041.984852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412042.120528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412042.245769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412042.378823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412042.510970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412042.640162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412042.774895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412042.907909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412043.032635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412043.183370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412043.283728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412043.407834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412043.547100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412043.673615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412043.802265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412043.926359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412044.047437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412044.180004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412044.312640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412044.429333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412044.547370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412044.677596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412044.799693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412044.940974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412045.051564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412045.173069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412045.303587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412045.447218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412045.572505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412045.695697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412045.839329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412045.985515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412046.113134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412046.237212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412046.359562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412046.502424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412046.627313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412046.747097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412046.863544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412046.989148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412047.117841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412047.244871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412047.366169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412047.492533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412047.620632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412047.772419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412047.881431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412048.032246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412048.143821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412048.277333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412048.398862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412048.539184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412048.668984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412048.794791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412048.923578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412049.044621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412049.172110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412049.310121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412049.421738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412049.545633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412049.672381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412049.824449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412049.927382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412050.050282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412050.193593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412050.311969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412050.434144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412050.568052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412050.704171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412050.834284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412050.970537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412051.095181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412051.229314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412051.355588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412051.482522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412051.610597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412051.734192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412051.880166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412052.001443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412052.131217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412052.278543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412052.403311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412052.541415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412052.662113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412052.791807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412052.924686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412053.046297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412053.174579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412053.303764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412053.431308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412053.555342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412053.694098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412053.807674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412053.939951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412054.069177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412054.195321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412054.337661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412054.465579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412054.598408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412054.731420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412054.855521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412054.986149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412055.123753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412055.236585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412055.355568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412055.484997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412055.608358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412055.742603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412055.865609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412055.989803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412056.112977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412056.238842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412056.382056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412056.488818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412056.610879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412056.741746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412056.866279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412056.991813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412057.115038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412057.239358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412057.366747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412057.490246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412057.613172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412057.759269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412057.869666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412058.006616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412058.155005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412058.300344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412058.440402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412058.546409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412058.673180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412058.806020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412058.937608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412059.052511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412059.185810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412059.299855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412059.433499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412059.570615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412059.687464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412059.851907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412060.133195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412060.420592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412060.716491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412061.005087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412061.214885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412061.434690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412061.619547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412061.822418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412062.005169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412062.203848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412062.348661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412062.554719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412062.707573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412062.887123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412063.060435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412063.242398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412063.452428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412063.597239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412063.754067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412063.911018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412064.124880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412064.294848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412064.429139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412064.614851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412064.762912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412064.988616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412065.189110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412065.357894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412065.507445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412065.643771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412065.809609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412065.983020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412066.167748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412066.341513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412066.496083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412066.656354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412066.809779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412067.008943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412067.169294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412067.325670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412067.511163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412067.695475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412067.862679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412068.018128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412068.325843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412068.474940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412068.629687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412068.732669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412068.868219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412068.990607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412069.128412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412069.256218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412069.380172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412069.507559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412069.651856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412069.786422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412069.918678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412070.041005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412070.179380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412070.300966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412070.431573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412070.547470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412070.679304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412070.807790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412070.933703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412071.056267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412071.281472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412071.436042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412071.566561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412071.688807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412071.819058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412071.946602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412072.081150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412072.229331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412072.354205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412072.470852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412072.614735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412072.734109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412072.881239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412072.992312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412073.131239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412073.245898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412073.374673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412073.502924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412073.627125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412073.768537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412073.906134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412074.026652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412074.156852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412074.280835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412074.421120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412074.537684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412074.671988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412074.795086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412074.942702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412075.051765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412075.180792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412075.318347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412075.429248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412075.546822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412075.679569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412075.810430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412075.961957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412076.084048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412076.223033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412076.355844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412076.493248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412076.615354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412076.747623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412076.892109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412077.002580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412077.129549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412077.261299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412077.393007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412077.523784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412077.653734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412077.794890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412077.916249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412078.047603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412078.174219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412078.297978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412078.413318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412078.550023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412078.660015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412078.797983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412078.933374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412079.061765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412079.180790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412079.307559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412079.452280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412079.560226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412079.691624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412079.838339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412079.954511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412080.080429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412080.215764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412080.347488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412080.475367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412080.609811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412080.732910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412080.869192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412080.988533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412081.111716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412081.246679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412081.371203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412081.503784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412081.620539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412081.751315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412081.900246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412082.032702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412082.160831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412082.296811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412082.421208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412082.556577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412082.674964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412082.794013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412082.923448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412083.049044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412083.198133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412083.305415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412083.435412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412083.561920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412083.685922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412083.818881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412083.960621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412084.095232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412084.238781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412084.356850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412084.484390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412084.609786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412084.744453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412084.854459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412084.992778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412085.118602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412085.245579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412085.378930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412085.506533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412085.626309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412085.756761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412085.884410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412086.017373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412086.167439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412086.383480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412086.672710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412086.892996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412087.061189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412087.194522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412087.324807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412087.464203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412087.593494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412087.740558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412087.869543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412087.996670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412088.135976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412088.255541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412088.399905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412088.530103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412088.665205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412088.802125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412088.923567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412089.058458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412089.184138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412089.313596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412089.445451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412089.569737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412089.695542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412089.850789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412089.970481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412090.106529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412090.233513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412090.366259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412090.490596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412090.628966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412090.732074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412090.861064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412090.979990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412091.126136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412091.250640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412091.389094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412091.523439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412091.669527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412091.798037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412091.926817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412092.049275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412092.207268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412092.313937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412092.440517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412092.581859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412092.688833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412092.819580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412092.964556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412093.105531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412093.221165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412093.357992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412093.489968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412093.617407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412093.743698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412093.874494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412094.005493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412094.128857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412094.258288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412094.387097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412094.528865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412094.658404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412094.784116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412094.919175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412095.046480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412095.166582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412095.304260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412095.420312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412095.546501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412095.662852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412095.794959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412095.921877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412096.048145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412096.175239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412096.296012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412096.424595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412096.554757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412096.675628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412096.820246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412096.928983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412097.060691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412097.179470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412097.326636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412097.439757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412097.582681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412097.699900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412097.845434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412097.972235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412098.109557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412098.225418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412098.375073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412098.482937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412098.632118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412098.755899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412098.877343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412099.046250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412099.172895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412099.289594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412099.417318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412099.544506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412099.675273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412099.800576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412099.923215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412100.053896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412100.206872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412100.334979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412100.465649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412100.595295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412100.720770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412100.849665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412100.983366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412101.111265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412101.238109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412101.366750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412101.495438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412101.620892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412101.777978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412101.886086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412102.025736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412102.163623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412102.313086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412102.417238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412102.554339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412102.671768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412102.794570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412102.945703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412103.066825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412103.192161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412103.330486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412103.456356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412103.607498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412103.725055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412103.876963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412103.984431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412104.110232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412104.229988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412104.363794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412104.479688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412104.606835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412104.730710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412104.858610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412104.985914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412105.110767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412105.229714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412105.360842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412105.484693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412105.613825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412105.752359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412105.882815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412105.992241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412106.126803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412106.251051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412106.381886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412106.506736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412106.655797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412106.787382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412106.917810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412107.035743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412107.157146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412107.287177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412107.423491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412107.547155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412107.678115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412107.824099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412107.935300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412108.062316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412108.189990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412108.331702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412108.461282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412108.575374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412108.713733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412108.848903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412108.996985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412109.126859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412109.237661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412109.360991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412109.492086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412109.613714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412109.741026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412109.864689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412109.993933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412110.119923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412110.252088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412110.378160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412110.502191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412110.638505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412110.777320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412110.910264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412111.048681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412111.176821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412111.299454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412111.425025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412111.553465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412111.681118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412111.805500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412111.927899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412112.055521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412112.180274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412112.317910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412112.441939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412112.565727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412112.698159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412112.837325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412112.973474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412113.112716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412113.228318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412113.353917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412113.483825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412113.628966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412113.744277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412113.875919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412114.006708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412114.138041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412114.276781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412114.414597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412114.537358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412114.672256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412114.807831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412114.927811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412115.046288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412115.174414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412115.302637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412115.425521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412115.546864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412115.675901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412115.803894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412115.941718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412116.074300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412116.189471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412116.320415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412116.458156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412116.590883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412116.715370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412116.852688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412116.980570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412117.112106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412117.242365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412117.362327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412117.487447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412117.610515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412117.738457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412117.857933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412117.991287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412118.115757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412118.256710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412118.385901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412118.510344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412118.648333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412118.787200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412118.904389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412119.035120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412119.160217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412119.296912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412119.422575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412119.554713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412119.688450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412119.819881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412119.958944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412120.079040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412120.221134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412120.360863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412120.474053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412120.614341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412120.722589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412120.869580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412120.984780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412121.130285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412121.235641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412121.364204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412121.482934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412121.610649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412121.723628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412121.870446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412122.001190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412122.127078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412122.259126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412122.391125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412122.521732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412122.656755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412122.782284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412122.916833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412123.037570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412123.169641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412123.296716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412123.426564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412123.557346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412123.676954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412123.807681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412123.941064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412124.083873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412124.197143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412124.335562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412124.464401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412124.588163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412124.714406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412124.842373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412124.977161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412125.101321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412125.225690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412125.356729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412125.484669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412125.610519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412125.737746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412125.853708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412125.986830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412126.101810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412126.238999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412126.375366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412126.502653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412126.637536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412126.765849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412126.903189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412127.039713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412127.166860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412127.293158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412127.418464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412127.540690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412127.659658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412127.805610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412127.941180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412128.064542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412128.184142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412128.317187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412128.448992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412128.574855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412128.713429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412128.830658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412128.959690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412129.099379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412129.218150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412129.355297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412129.500304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412129.613416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412129.747954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412129.875805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412130.003781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412130.149108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412130.268249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412130.406736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412130.530061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412130.671930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412130.810821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412130.925490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412131.046110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412131.186828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412131.302681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412131.462502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412131.587162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412131.714523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412131.843869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412131.984310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412132.105060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412132.229554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412132.358966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412132.501195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412132.630700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412132.779939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412132.903371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412133.037601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412133.166682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412133.290459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412133.414958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412133.544026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412133.667221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412133.801815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412133.924108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412134.041658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412134.184741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412134.297943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412134.425486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412134.551019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412134.665016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412134.797337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412134.922188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412135.050651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412135.173237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412135.313973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412135.437123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412135.570226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412135.708630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412135.875669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412135.981968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412136.115487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412136.232112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412136.362389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412136.485792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412136.623796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412136.752104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412136.875661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412136.994341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412137.138532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412137.258168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412137.399222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412137.525729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412137.644855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412137.773788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412137.904471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412138.035670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412138.167591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412138.291459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412138.432685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412138.545218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412138.682083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412138.802405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412138.936210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412139.065351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412139.199014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412139.336229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412139.476570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412139.603595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412139.732202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412139.847476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412139.984522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412140.113720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412140.238333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412140.364572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412140.514666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412140.625102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412140.762449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412140.880153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412141.010952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412141.131699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412141.274362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412141.400546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412141.529405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412141.667833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412141.801898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412141.923093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412142.050161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412142.189622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412142.303308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412142.438580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412142.550721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412142.675267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412142.804567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412142.926053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412143.066303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412143.179310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412143.307943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412143.433661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412143.574163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412143.692365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412143.845180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412143.946698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412144.088229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412144.214342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412144.354561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412144.472709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412144.604125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412144.721878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412144.851251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412144.983801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412145.119861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412145.256113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412145.364810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412145.490327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412145.627855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412145.742095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412145.880827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412146.013812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412146.143197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412146.284045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412146.400619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412146.533178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412146.667239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412146.793834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412146.920738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412147.040274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412147.171532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412147.294477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412147.427251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412147.547417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412147.677095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412147.798993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412147.926068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412148.055624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412148.173013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412148.289246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412148.417909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412148.548454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412148.675788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412148.800281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412148.926141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412149.056945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412149.183837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412149.312680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412149.439642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412149.562718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412149.697643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412149.838287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412149.963497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412150.089150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412150.223669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412150.348652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412150.478673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412150.605116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412150.734442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412150.856633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412151.002867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412151.110089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412151.237845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412151.369749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412151.504812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412151.636597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412151.779166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412151.919476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412152.048126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412152.173229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412152.301204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412152.426556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412152.554916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412152.681761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412152.816258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412152.937091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412153.072169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412153.210994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412153.347148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412153.476090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412153.608345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412153.724148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412153.861922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412153.991820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412154.111120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412154.235533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412154.361363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412154.483157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412154.612314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412154.738355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412154.877531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412154.988201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412155.112357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412155.237890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412155.361307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412155.501194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412155.627341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412155.756362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412155.906605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412156.025374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412156.155332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412156.282179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412156.439935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412156.568243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412156.690542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412156.838523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412156.972038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412157.102149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412157.229658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412157.350454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412157.481114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412157.614299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412157.736371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412157.857354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412157.978290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412158.122644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412158.234533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412158.357319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412158.486883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412158.610436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412158.742107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412158.868547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412159.000520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412159.137860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412159.253618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412159.392719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412159.533598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412159.664738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412159.787993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412159.913110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412160.036996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412160.168308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412160.299498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412160.424532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412160.552245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412160.671348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412160.800463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412160.925476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412161.066367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412161.192453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412161.312730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412161.429121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412161.574622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412161.706278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412161.838935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412161.968623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412162.094127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412162.219319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412162.348819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412162.481646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412162.612951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412162.734366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412162.862983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412162.976571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412163.111722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412163.235838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412163.365080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412163.486795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412163.614601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412163.733867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412163.864988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412164.001511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412164.115859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412164.242555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412164.369498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412164.503303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412164.622304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412164.761248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412164.877710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412165.025531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412165.133530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412165.276875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412165.418356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412165.531319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412165.667850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412165.792319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412165.923754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412166.043794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412166.175635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412166.301368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412166.437250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412166.568859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412166.684715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412166.805165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412166.936975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412167.052261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412167.186936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412167.311368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412167.438318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412167.583476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412167.706298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412167.844658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412167.978752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412168.106222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412168.232087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412168.371912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412168.484461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412168.607882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412168.738353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412168.865414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412168.990589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412169.115932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412169.242218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412169.378099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412169.499269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412169.617780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412169.748931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412169.884543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412170.003841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412170.136267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412170.278049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412170.401886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412170.538682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412170.662974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412170.796784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412170.920768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412171.056275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412171.168932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412171.310907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412171.421650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412171.548087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412171.673659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412171.800598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412171.941367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412172.077537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412172.211312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412172.347181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412172.474662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412172.604799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412172.732729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412172.856079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412172.977652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412173.111419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412173.234125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412173.361605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412173.483008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412173.617887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412173.727548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412173.861309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412173.985417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412174.126790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412174.233599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412174.382844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412174.485945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412174.618982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412174.747278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412174.875544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412175.006027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412175.135183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412175.254995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412175.390684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412175.527226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412175.650072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412175.787828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412175.928076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412176.049990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412176.186873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412176.320611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412176.433304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412176.566009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412176.713892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412176.835777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412176.977923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412177.094132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412177.220473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412177.345087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412177.485163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412177.601626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412177.728721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412177.864661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412177.995234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412178.126304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412178.246378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412178.375437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412178.518272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412178.649083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412178.803738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412178.912206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412179.047678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412179.177586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412179.291338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412179.423659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412179.543227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412179.669732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412179.799765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412179.925936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412180.054821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412180.300849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412180.642505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412181.001844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412181.400887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412181.614608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412181.900308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412182.050942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412182.237758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412182.379517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412182.566451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412182.730970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412182.932666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412183.121296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412183.260856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412183.437229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412183.654635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412183.802148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412183.999871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412184.170285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412184.320826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412184.537699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412184.682235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412184.831984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412185.017062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412185.172818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412185.358439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412185.619225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412185.751718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412185.898586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412186.045995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412186.200195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412186.366184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412186.551181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412186.699493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412186.862709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412187.048779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412187.210023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412187.369791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412187.552804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412187.735804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412187.914813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412188.104874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412188.241001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412188.460158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412188.772738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412188.895513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412189.030216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412189.160004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412189.289358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412189.426983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412189.561096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412189.690309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412189.830254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412189.960742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412190.084006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412190.229873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412190.358069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412190.484041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412190.614937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412190.736902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412190.867016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412191.004137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412191.147737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412191.251404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412191.376786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412191.549553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412191.751038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412191.894170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412192.024427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412192.168905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412192.291830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412192.427294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412192.556589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412192.680701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412192.825853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412192.957758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412193.089965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412193.222987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412193.346315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412193.483515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412193.614919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412193.752964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412193.873234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412194.000424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412194.127791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412194.255294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412194.398912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412194.522797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412194.653349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412194.782234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412194.912195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412195.037718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412195.172429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412195.289490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412195.424312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412195.545703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412195.671523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412195.799221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412195.924551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412196.044174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412196.177080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412196.295972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412196.428104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412196.557065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412196.713051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412196.844131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412196.978481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412197.100737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412197.233186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412197.349838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412197.480754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412197.605694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412197.732228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412197.856329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412197.985260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412198.113239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412198.236619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412198.364500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412198.493511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412198.617779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412198.753875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412198.886448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412199.033147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412199.142568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412199.288599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412199.408872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412199.542535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412199.665864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412199.790776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412199.914698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412200.066423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412200.169045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412200.311579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412200.423835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412200.554765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412200.689350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412200.814227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412200.946441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412201.089653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412201.220480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412201.365252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412201.482193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412201.608963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412201.733967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412201.865476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412202.019468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412202.144813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412202.275552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412202.401948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412202.545066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412202.689306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412202.794271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412202.931651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412203.050977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412203.189647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412203.303299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412203.458170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412203.563953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412203.706332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412203.835799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412203.982720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412204.094845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412204.228079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412204.354828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412204.501294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412204.625545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412204.756736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412204.885779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412205.026806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412205.164230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412205.293913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412205.417643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412205.549342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412205.671642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412205.811754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412205.938778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412206.045164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412206.173700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412206.299182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412206.426743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412206.585697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412206.701607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412206.832969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412206.957808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412207.101795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412207.235332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412207.345031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412207.475760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412207.598505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412207.727947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412207.871312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412208.000978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412208.104182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412208.232254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412208.375932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412208.484575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412208.613244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412208.740908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412208.883708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412209.008371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412209.159015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412209.286880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412209.417546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412209.548563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412209.692758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412209.801996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412209.938369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412210.063393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412210.196191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412210.317899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412210.463468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412210.576708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412210.723010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412210.844339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412210.989524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412211.111686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412211.233568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412211.355780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412211.484410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412211.606158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412211.745149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412211.879838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412212.010018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412212.133368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412212.259904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412212.413528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412212.552777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412212.666352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412212.812283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412212.944860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412213.060972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412213.203566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412213.352392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412213.474613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412213.606747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412213.731616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412213.876483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412214.013308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412214.138310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412214.270216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412214.398085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412214.526813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412214.662939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412214.781787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412214.916719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412215.041282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412215.167166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412215.296839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412215.425635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412215.545184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412215.667924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412215.811759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412215.926116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412216.042295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412216.175015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412216.296450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412216.419044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412216.549075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412216.677063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412216.806273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412216.941563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412217.052270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412217.178710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412217.300822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412217.431681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412217.553673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412217.678076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412217.810910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412217.936779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412218.090491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412218.224878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412218.336982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412218.472128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412218.592375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412218.727645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412218.846124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412218.975027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412219.106417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412219.238828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412219.351952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412219.498284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412219.619501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412219.731385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412219.861790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412219.984725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412220.121471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412220.280890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412220.380050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412220.545525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412220.667018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412220.788558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412220.935636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412221.049359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412221.177821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412221.325266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412221.436822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412221.566717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412221.697007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412221.842951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412221.973650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412222.104730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412222.226362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412222.357516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412222.483133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412222.606879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412222.732864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412222.858101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412222.994065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412223.123630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412223.235043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412223.363232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412223.484704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412223.622496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412223.739210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412223.884724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412224.003232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412224.151701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412224.286778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412224.416888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412224.538838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412224.668941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412224.790666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412224.941709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412225.061951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412225.178741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412225.312432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412225.436779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412225.565489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412225.705751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412225.828201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412225.968265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412226.088812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412226.218410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412226.353553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412226.481976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412226.598545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412226.724270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412226.854773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412226.983124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412227.107634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412227.234531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412227.359593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412227.484967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412227.609874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412227.733070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412227.854865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412227.986824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412228.106802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412228.257988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412228.364290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412228.496170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412228.626858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412228.769842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412228.875386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412229.014272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412229.151457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412229.291800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412229.409267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412229.553454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412229.664499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412229.797482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412229.911806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412230.047439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412230.181208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412230.293741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412230.429256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412230.567567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412230.678335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412230.834628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412230.955704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412231.082374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412231.220739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412231.347539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412231.478935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412231.599075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412231.729763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412231.852018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412231.979890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412232.111613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412232.238932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412232.369746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412232.495485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412232.633275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412232.766872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412232.902102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412233.024952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412233.162646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412233.289034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412233.414462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412233.544739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412233.672915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412233.810063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412233.921658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412234.060371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412234.171086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412234.293418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412234.422431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412234.545577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412234.677508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412234.800570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412234.927986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412235.056102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412235.183529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412235.312771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412235.439851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412235.567247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412235.707197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412235.834167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412235.970179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412236.092931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412236.232000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412236.356598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412236.484560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412236.604616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412236.739127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412236.855660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412236.978343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412237.107638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412237.232317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412237.365265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412237.493891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412237.616891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412237.755336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412237.882688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412238.019940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412238.147718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412238.278579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412238.406923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412238.571628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412238.680335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412238.833717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412238.942821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412239.090250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412239.215546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412239.338108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412239.460799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412239.602931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412239.719753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412239.857801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412239.980062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412240.103709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412240.230432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412240.352118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412240.475304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412240.621435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412240.731124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412240.859876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412240.992008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412241.116352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412241.295356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412241.460088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412241.587288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412241.719445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412241.874952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412242.021597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412242.138934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412242.272544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412242.400224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412242.543101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412242.663580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412242.800608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412242.919622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412243.049867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412243.174959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412243.301653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412243.422535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412243.549253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412243.674008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412243.813726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412243.937618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412244.086361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412244.218785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412244.353052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412244.474811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412244.608308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412244.741235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412244.863765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412244.983282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412245.122703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412245.230778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412245.356990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412245.488708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412245.628116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412245.742656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412245.900190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412246.005527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412246.147140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412246.274778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412246.406452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412246.529525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412246.663404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412246.785746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412246.915653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412247.040951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412247.174181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412247.297564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412247.431787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412247.559606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412247.687590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412247.831275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412247.974183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412248.088699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412248.229568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412248.355053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412248.483307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412248.593538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412248.721001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412248.845864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412248.980946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412249.122762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412249.239590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412249.376599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412249.496301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412249.621632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412249.760233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412249.895113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412250.024105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412250.150168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412250.297214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412250.418557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412250.544369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412250.668238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412250.809528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412250.916689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412251.047945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412251.191654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412251.308201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412251.427073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412251.564561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412251.689903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412251.848039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412251.960524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412252.099455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412252.215155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412252.339469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412252.472858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412252.609668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412252.734378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412252.860861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412252.986221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412253.124140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412253.248358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412253.366896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412253.500464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412253.638964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412253.767974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412253.908983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412254.036817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412254.167464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412254.288521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412254.417692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412254.539865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412254.687139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412254.792192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412254.926130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412255.056442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412255.170140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412255.296587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412255.421626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412255.548063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412255.686477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412255.824987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412255.964010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412256.105708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412256.230609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412256.356067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412256.498019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412256.617415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412256.743189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412256.874732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412257.003287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412257.128804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412257.276864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412257.395405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412257.537201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412257.658513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412257.792173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412257.930362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412258.064122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412258.172799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412258.296382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412258.435881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412258.553700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412258.691753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412258.823586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412258.945024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412259.093283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412259.222019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412259.345184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412259.473832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412259.606340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412259.724990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412259.875896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412259.984385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412260.119027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412260.252005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412260.383064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412260.518466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412260.651413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412260.787806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412260.912245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412261.040104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412261.171955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412261.297158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412261.428610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412261.557986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412261.679707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412261.817050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412261.927011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412262.049119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412262.178303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412262.309578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412262.436827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412262.582093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412262.725583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412262.844883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412262.973355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412263.098923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412263.221706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412263.354093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412263.483031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412263.618334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412263.736491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412263.852645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412263.986845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412264.109946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412264.248508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412264.381012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412264.508648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412264.646351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412264.784100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412264.908232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412265.037763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412265.157699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412265.292536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412265.415293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412265.541204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412265.670056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412265.792618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412265.934748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412266.053694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412266.185574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412266.319284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412266.457690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412266.584163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412266.731758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412266.855154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412266.998418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412267.111400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412267.241050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412267.373107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412267.500395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412267.641314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412267.772508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412267.907309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412268.039989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412268.170248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412268.296260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412268.424937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412268.552253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412268.673589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412268.799479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412268.925666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412269.049491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412269.182652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412269.305756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412269.457481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412269.583356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412269.721981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412269.849949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412269.974374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412270.100309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412270.227880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412270.344351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412270.499164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412270.599587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412270.733963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412270.852947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412270.980241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412271.098687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412271.230645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412271.350804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412271.477281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412271.617572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412271.725276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412271.870743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412272.007326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412272.129681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412272.270949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412272.403436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412272.540692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412272.667361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412272.791333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412272.917886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412273.043625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412273.169368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412273.295112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412273.417181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412273.542945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412273.669849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412273.796683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412273.925170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412274.052399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412274.179852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412274.310917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412274.461369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412274.584196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412274.719539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412274.837833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412274.968475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412275.099454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412275.224799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412275.355421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412275.472283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412275.594455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412275.715804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412275.841491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412275.972331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412276.095628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412276.216596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412276.353070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412276.472800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412276.616305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412276.731092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412276.858890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412276.974728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412277.108850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412277.229264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412277.360531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412277.478334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412277.602494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412277.730669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412277.873420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412277.978920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412278.111463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412278.234681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412278.384513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412278.488113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412278.624283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412278.771761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412278.914901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412279.034199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412279.159827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412279.282422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412279.419100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412279.526604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412279.664219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412279.793842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412279.919631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412280.035956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412280.185036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412280.287608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412280.419317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412280.547425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412280.682260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412280.802001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412280.929506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412281.070423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412281.192134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412281.329220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412281.475040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412281.593169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412281.718049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412281.848524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412281.981100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412282.104503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412282.232403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412282.361421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412282.480365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412282.604074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412282.752020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412282.868468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412282.983858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412283.122703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412283.249471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412283.386893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412283.523984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412283.664433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412283.796391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412283.919190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412284.047856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412284.168416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412284.297644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412284.413063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412284.555233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412284.666745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412284.790009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412284.917476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412285.048876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412285.167111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412285.294160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412285.416035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412285.546041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412285.665245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412285.798070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412285.921533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412286.049328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412286.175134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412286.311224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412286.425914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412286.555281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412286.684405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412286.818574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412286.936157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412287.081822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412287.202044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412287.335986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412287.464230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412287.593249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412287.727090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412287.857819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412287.977756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412288.110012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412288.231187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412288.361311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412288.500952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412288.613658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412288.738142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412288.879740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412289.019572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412289.141549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412289.265113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412289.406392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412289.525479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412289.662228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412289.791867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412289.914574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412290.038594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412290.170290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412290.287093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412290.413597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412290.539934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412290.670354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412290.793407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412290.937260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412291.046582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412291.172054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412291.300915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412291.430896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412291.559960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412291.678875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412291.809886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412291.952442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412292.110738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412292.240202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412292.346890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412292.489203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412292.606240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412292.736062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412292.857754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412292.983019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412293.113066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412293.250945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412293.372145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412293.509435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412293.644355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412293.768678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412293.894652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412294.027978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412294.152471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412294.288542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412294.414161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412294.544576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412294.682946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412294.806972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412294.935832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412295.046185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412295.175050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412295.321755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412295.433453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412295.569870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412295.707559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412295.839067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412295.974621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412296.098851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412296.226966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412296.355003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412296.479438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412296.621459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412296.737631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412296.872010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412296.991866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412297.114974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412297.248288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412297.391055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412297.515101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412297.632138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412297.772195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412297.906204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412298.036159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412298.163980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412298.282892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412298.416974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412298.539876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412298.666603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412298.790084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412298.921474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412299.041294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412299.171224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412299.295160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412299.433118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412299.599644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412299.723971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412299.870307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412299.997012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412300.110187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412300.311477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412300.644540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412300.988060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412301.421211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412301.577610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412301.791467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412302.006397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412302.273462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412302.491376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412302.674942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412302.858222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412302.997685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412303.172113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412303.355748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412303.519667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412303.706229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412303.858025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412304.034996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412304.211854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412304.414792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412304.622252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412304.809628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412304.980072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412305.144436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412305.335069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412305.486648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412305.786822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412305.924681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412306.053580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412306.194198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412306.369761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412306.544842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412306.718416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412306.902397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412307.060621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412307.245201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412307.443252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412307.582994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412307.792504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412307.935124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412308.113147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412308.298362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412308.477736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412308.800031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412308.958266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412309.104100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412309.217374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412309.352055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412309.476599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412309.596542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412309.740364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412309.893054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412309.994488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412310.124170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412310.249512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412310.390816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412310.514835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412310.666802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412310.794597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412310.916036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412311.054868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412311.173783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412311.306154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412311.435193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412311.554559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412311.701591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412311.921173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412312.059165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412312.185265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412312.310158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412312.442282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412312.569285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412312.718259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412312.851762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412312.971837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412313.097868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412313.227373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412313.350808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412313.489976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412313.593263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412313.716938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412313.847834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412313.975604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412314.100929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412314.231213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412314.355484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412314.484392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412314.605327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412314.727240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412314.873326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412314.986437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412315.109639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412315.239099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412315.372841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412315.520935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412315.637973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412315.772585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412315.903241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412316.026645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412316.153322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412316.296270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412316.419437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412316.542943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412316.672396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412316.794623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412316.927156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412317.078912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412317.217725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412317.338749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412317.476346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412317.595961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412317.727180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412317.855757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412317.983217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412318.122956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412318.231932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412318.363341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412318.491372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412318.614971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412318.740448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412318.872567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412318.999629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412319.131505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412319.260509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412319.400547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412319.530178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412319.662518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412319.783653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412319.923270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412320.049150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412320.178468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412320.313848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412320.434738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412320.564678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412320.687764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412320.831932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412320.967014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412321.085785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412321.223541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412321.345374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412321.484471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412321.602214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412321.720940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412321.851935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412321.977910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412322.102740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412322.232807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412322.354324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412322.485373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412322.604497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412322.731959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412322.865710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412322.986863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412323.113603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412323.239962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412323.374644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412323.516369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412323.645430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412323.782223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412323.910522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412324.037229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412324.156404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412324.286516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412324.435702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412324.549415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412324.703076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412324.839506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412324.972518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412325.100405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412325.223387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412325.358370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412325.481251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412325.610136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412325.737815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412325.861069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412325.998734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412326.132808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412326.268929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412326.400953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412326.531590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412326.661856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412326.783489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412326.904470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412327.023797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412327.163978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412327.281271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412327.408562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412327.536229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412327.666524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412327.784944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412327.913476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412328.039986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412328.160665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412328.286932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412328.415973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412328.548093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412328.669128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412328.793869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412328.917733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412329.046022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412329.169320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412329.291129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412329.414911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412329.547299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412329.675244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412329.797934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412329.926021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412330.045968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412330.176386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412330.299879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412330.429023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412330.571047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412330.699702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412330.833150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412330.987988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412331.121638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412331.250237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412331.358160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412331.482214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412331.607951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412331.739235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412331.878821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412332.029860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412332.155785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412332.282521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412332.407159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412332.544521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412332.651330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412332.792902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412332.907569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412333.035300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412333.170490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412333.283699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412333.410288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412333.541596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412333.667751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412333.793781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412333.912662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412334.042246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412334.169659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412334.291826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412334.414168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412334.537404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412334.662674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412334.792869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412334.918366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412335.046810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412335.165719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412335.296220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412335.411465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412335.542532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412335.670933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412335.801189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412335.917772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412336.045430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412336.177692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412336.314190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412336.435251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412336.563828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412336.702521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412336.849724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412336.974782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412337.102260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412337.224761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412337.357045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412337.474278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412337.594322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412337.735412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412337.861796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412337.985646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412338.118395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412338.256373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412338.392936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412338.526206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412338.654159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412338.776341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412338.912333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412339.042362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412339.159029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412339.294882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412339.419675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412339.546308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412339.674624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412339.792501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412339.924167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412340.050935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412340.192055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412340.297541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412340.436486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412340.547727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412340.702943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412340.830513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412340.975309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412341.103585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412341.231272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412341.358859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412341.482446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412341.618096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412341.743308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412341.874670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412342.020926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412342.155810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412342.279691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412342.428756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412342.530947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412342.653175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412342.783742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412342.901412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412343.026271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412343.157783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412343.309001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412343.411971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412343.544433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412343.676344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412343.783154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412343.913542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412344.035990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412344.160528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412344.293561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412344.416469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412344.540483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412344.665422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412344.806752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412344.928933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412345.048716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412345.167074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412345.293541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412345.412674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412345.539951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412345.670567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412345.794479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412345.917479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412346.044800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412346.181780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412346.311344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412346.435930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412346.601972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412346.711519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412346.831459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412346.964828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412347.087721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412347.223698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412347.361866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412347.476396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412347.607707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412347.732364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412347.856210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412347.983166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412348.109608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412348.232126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412348.362151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412348.494477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412348.621875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412348.753322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412348.873213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412349.014672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412349.149669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412349.277672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412349.423651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412349.535109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412349.653464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412349.788115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412349.915286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412350.035923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412350.166968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412350.286897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412350.418393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412350.550747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412350.662831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412350.788450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412350.914842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412351.040395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412351.167259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412351.291517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412351.415950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412351.542082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412351.669733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412351.796638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412351.919366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412352.041745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412352.167609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412352.291167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412352.411262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412352.537235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412352.666117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412352.792171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412352.916878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412353.037046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412353.175285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412353.293556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412353.430335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412353.547792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412353.683393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412353.791602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412353.930224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412354.053038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412354.183223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412354.301703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412354.433744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412354.560740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412354.697912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412354.832105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412354.970129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412355.098604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412355.224797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412355.352233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412355.469553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412355.600660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412355.718068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412355.845098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412355.975248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412356.108172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412356.227805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412356.351903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412356.479308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412356.599057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412356.730876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412356.858758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412356.988243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412357.128462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412357.254707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412357.391184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412357.525471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412357.649669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412357.788302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412357.909516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412358.039666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412358.162483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412358.295547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412358.427634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412358.543043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412358.669368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412358.796204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412358.920140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412359.044081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412359.172849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412359.311896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412359.424187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412359.565438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412359.687339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412359.819461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412359.956158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412360.082127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412360.220171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412360.349288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412360.465888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412360.593160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412360.716400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412360.844626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412360.971371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412361.103112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412361.238206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412361.380992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412361.515955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412361.643761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412361.771929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412361.934962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412362.049084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412362.175012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412362.299939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412362.443095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412362.563059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412362.697332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412362.837175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412362.981118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412363.097981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412363.228986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412363.370222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412363.476515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412363.612911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412363.736804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412363.880373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412364.012913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412364.142660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412364.280580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412364.420321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412364.532989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412364.668583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412364.784609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412364.908841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412365.038441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412365.153508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412365.282372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412365.411611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412365.543561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412365.654422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412365.790397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412365.906098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412366.033358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412366.164617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412366.285704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412366.418183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412366.542460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412366.681694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412366.792158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412366.930514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412367.058345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412367.181845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412367.307289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412367.465186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412367.601459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412367.719093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412367.846991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412367.973251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412368.104158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412368.230404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412368.355174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412368.484778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412368.607800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412368.731347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412368.852673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412368.978864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412369.113485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412369.255038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412369.370964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412369.496500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412369.620033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412369.758173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412369.893964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412370.028839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412370.163482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412370.285255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412370.414255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412370.540170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412370.665979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412370.786487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412370.917748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412371.044041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412371.173683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412371.300402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412371.432175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412371.566931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412371.708104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412371.849312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412371.982079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412372.099398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412372.230958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412372.354224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412372.474416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412372.599705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412372.747189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412372.854186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412372.982117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412373.106871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412373.232178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412373.356929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412373.487236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412373.621271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412373.811801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412373.919930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412374.046546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412374.171366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412374.296310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412374.427438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412374.551525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412374.686060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412374.804642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412374.934980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412375.071439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412375.199714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412375.348875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412375.462893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412375.600022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412375.727784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412375.871315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412375.998880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412376.141830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412376.272508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412376.424407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412376.530190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412376.656186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412376.793788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412376.927706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412377.052506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412377.177704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412377.295799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412377.430074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412377.547518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412377.701439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412377.812293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412377.937767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412378.059723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412378.205282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412378.330730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412378.462269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412378.584897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412378.734629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412378.848604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412378.969237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412379.106108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412379.228856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412379.357348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412379.477498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412379.603889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412379.733343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412379.860324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412379.982890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412380.106720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412380.238533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412380.368647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412380.494394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412380.619382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412380.761825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412380.884115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412381.017716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412381.155627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412381.291714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412381.410576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412381.540479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412381.661338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412381.790770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412381.921739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412382.052407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412382.183555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412382.325144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412382.446615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412382.586620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412382.722777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412382.843302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412382.963202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412383.096183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412383.221625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412383.348017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412383.463408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412383.599589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412383.715716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412383.858430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412383.994328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412384.121146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412384.251235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412384.392562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412384.499124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412384.651418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412384.767189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412384.894534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412385.024616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412385.158382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412385.275805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412385.401313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412385.527082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412385.663095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412385.794949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412385.917235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412386.044297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412386.196439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412386.454780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412386.621631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412386.765952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412386.892351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412387.025240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412387.151514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412387.288529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412387.409210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412387.535638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412387.654965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412387.806465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412387.919509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412388.048833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412388.170621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412388.311399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412388.432958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412388.573973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412388.701290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412388.832344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412388.959300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412389.096281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412389.232213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412389.356226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412389.476884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412389.604858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412389.735698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412389.861342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412389.982897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412390.109642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412390.247367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412390.378239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412390.502081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412390.637858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412390.767477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412390.892249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412391.005867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412391.151778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412391.288483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412391.416433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412391.530421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412391.666303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412391.792024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412391.951865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412392.076962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412392.221417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412392.347149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412392.488744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412392.606337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412392.735783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412392.858939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412392.986709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412393.111513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412393.241559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412393.362075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412393.489366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412393.620368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412393.769439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412393.895685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412394.031728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412394.158437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412394.299917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412394.412430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412394.545268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412394.661892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412394.800330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412394.930850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412395.050540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412395.186670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412395.292223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412395.420637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412395.555354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412395.679223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412395.811100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412395.940525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412396.098325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412396.213473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412396.351192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412396.492517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412396.605273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412396.728287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412396.872808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412396.997162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412397.153625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412397.275059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412397.431337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412397.526905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412397.660861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412397.788909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412397.916772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412398.037798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412398.176637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412398.291446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412398.442136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412398.544082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412398.682640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412398.807431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412398.945235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412399.077851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412399.230199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412399.339500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412399.475168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412399.596134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412399.728302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412399.855129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412399.996477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412400.106974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412400.246911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412400.367353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412400.491719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412400.625186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412400.754978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412400.883427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412401.028306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412401.158856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412401.283713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412401.416685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412401.538055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412401.662290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412401.791792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412401.909190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412402.032182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412402.161741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412402.290324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412402.412728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412402.546134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412402.685037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412402.793957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412402.920770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412403.055246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412403.180788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412403.321605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412403.442192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412403.588855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412403.712423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412403.850751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412403.968554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412404.103616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412404.227325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412404.355089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412404.476870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412404.606982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412404.731051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412404.857250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412404.977654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412405.102789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412405.226820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412405.362701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412405.475744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412405.596672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412405.720039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412405.853370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412405.975294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412406.103436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412406.238376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412406.348201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412406.477310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412406.602623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412406.723566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412406.858042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412406.982505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412407.106850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412407.231840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412407.363704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412407.482386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412407.608726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412407.744069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412407.869972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412407.987083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412408.119350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412408.251838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412408.401112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412408.521851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412408.656356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412408.780569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412408.911701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412409.044207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412409.163197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412409.285365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412409.413467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412409.536320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412409.667494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412409.789337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412409.930120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412410.043748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412410.179869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412410.316006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412410.432912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412410.563935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412410.696430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412410.810312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412410.957879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412411.080944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412411.223023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412411.342119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412411.471802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412411.597459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412411.724567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412411.841090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412411.974749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412412.098859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412412.222230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412412.351526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412412.480412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412412.606625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412412.731988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412412.854158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412412.984960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412413.141342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412413.268140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412413.386875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412413.530381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412413.643990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412413.782259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412413.896050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412414.019908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412414.158011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412414.279488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412414.409881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412414.536861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412414.674657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412414.782449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412414.908077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412415.078916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412415.201564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412415.336049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412415.461686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412415.591044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412415.707907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412415.834229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412415.967931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412416.098328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412416.221812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412416.350895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412416.478400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412416.603542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412416.721721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412416.853119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412416.980663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412417.108265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412417.233201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412417.361271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412417.513681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412417.626311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412417.752667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412417.896001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412418.028855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412418.173405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412418.288039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412418.412761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412418.553992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412418.685994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412418.796724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412418.923074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412419.051005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412419.221518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412419.348872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412419.497124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412419.602079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412419.726757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412419.863193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412420.014050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412420.138881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412420.268759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412420.405174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412420.524377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412420.655823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412420.795131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412421.025569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412421.292641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412421.627862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412421.993961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412422.295826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412422.508562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412422.723685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412422.941409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412423.157353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412423.360329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412423.540329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412423.707475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412423.894356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412424.085613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412424.242287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412424.429373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412424.570989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412424.787799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412424.933667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412425.123376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412425.273340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412425.494713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412425.641136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412425.832327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412425.988378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412426.166283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412426.368240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412426.645744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412426.787673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412426.917750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412427.056670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412427.253567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412427.399483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412427.556948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412427.729196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412427.936062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412428.091404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412428.259579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412428.419819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412428.605132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412428.772441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412428.935141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412429.109975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412429.284490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412429.444355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412429.612271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412429.866261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412430.079681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412430.202912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412430.329108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412430.457147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412430.598603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412430.725253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412430.850396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412430.982617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412431.120257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412431.231039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412431.390539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412431.494385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412431.640932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412431.773408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412431.892631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412432.020299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412432.154473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412432.287190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412432.417478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412432.541920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412432.697512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412432.896486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412433.056126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412433.199241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412433.335952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412433.467118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412433.595519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412433.719066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412433.855987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412433.972784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412434.103781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412434.233986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412434.350924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412434.479645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412434.606854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412434.742410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412434.869439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412434.992367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412435.122611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412435.242555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412435.382187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412435.503949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412435.656755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412435.784628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412435.915805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412436.040913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412436.168334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412436.290177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412436.420194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412436.543470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412436.675059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412436.808635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412436.931211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412437.059927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412437.196618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412437.330275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412437.450184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412437.589950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412437.720428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412437.840325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412437.971318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412438.108059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412438.241062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412438.376539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412438.516378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412438.648190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412438.793158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412438.904712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412439.032276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412439.177926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412439.291199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412439.448450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412439.576649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412439.702347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412439.840276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412439.965244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412440.098777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412440.241139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412440.355709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412440.491443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412440.599239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412440.727137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412440.853180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412440.975993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412441.106565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412441.248692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412441.359866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412441.493984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412441.626913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412441.762832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412441.910379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412442.021429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412442.160671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412442.272371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412442.410470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412442.536798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412442.670696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412442.793245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412442.921738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412443.043125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412443.170167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412443.294835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412443.425151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412443.547486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412443.683534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412443.814153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412443.948789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412444.099620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412444.204489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412444.334726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412444.473422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412444.596742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412444.746036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412444.856675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412444.987927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412445.115536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412445.243872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412445.364966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412445.498210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412445.620647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412445.743766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412445.888580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412446.008053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412446.139958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412446.273648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412446.393920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412446.545267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412446.655481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412446.805615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412446.911688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412447.043019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412447.181517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412447.289117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412447.431538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412447.540373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412447.664381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412447.796691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412447.925669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412448.054707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412448.174033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412448.298315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412448.438954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412448.581628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412448.710952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412448.846663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412448.969705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412449.093178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412449.218928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412449.349995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412449.477850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412449.624257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412449.741308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412449.861301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412449.994376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412450.134930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412450.272142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412450.403795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412450.534970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412450.664470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412450.802798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412450.922789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412451.047481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412451.178610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412451.311889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412451.442452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412451.581972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412451.720875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412451.850711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412451.999860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412452.133216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412452.274158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412452.403542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412452.543976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412452.669343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412452.810893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412452.934089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412453.070458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412453.207704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412453.339628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412453.473446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412453.594335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412453.714083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412453.847459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412453.975078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412454.102115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412454.240031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412454.350382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412454.473996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412454.611838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412454.741498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412454.856626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412454.980266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412455.114658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412455.234962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412455.374538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412455.491709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412455.625823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412455.757896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412455.892640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412456.021888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412456.152000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412456.275560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412456.401331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412456.523172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412456.667671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412456.783150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412456.908437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412457.041167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412457.164686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412457.288880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412457.422347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412457.543015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412457.675315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412457.802670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412457.929595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412458.054302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412458.204627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412458.332570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412458.459695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412458.588711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412458.724512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412458.851082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412458.975636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412459.097902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412459.239668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412459.372394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412459.495302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412459.641104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412459.768221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412459.894076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412460.034117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412460.157279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412460.279970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412460.412952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412460.534959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412460.670954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412460.807087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412460.907260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412461.038458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412461.160292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412461.290991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412461.416586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412461.540549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412461.680512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412461.792322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412461.931086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412462.047970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412462.176763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412462.314909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412462.432735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412462.569138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412462.703052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412462.855712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412462.992992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412463.104140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412463.223164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412463.352118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412463.481079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412463.610151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412463.739544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412463.870673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412463.993757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412464.120462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412464.248142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412464.389518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412464.517593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412464.654423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412464.773596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412464.908069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412465.036574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412465.151493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412465.282495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412465.432651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412465.548996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412465.695555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412465.834541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412465.976848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412466.097930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412466.222115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412466.344490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412466.472087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412466.599426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412466.721078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412466.850448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412466.972426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412467.097248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412467.222613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412467.341973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412467.474565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412467.599131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412467.727047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412467.862980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412467.974775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412468.101795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412468.225148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412468.349181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412468.477746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412468.615080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412468.723993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412468.855241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412468.977889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412469.102436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412469.221997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412469.357719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412469.483681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412469.608453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412469.734190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412469.856950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412469.984086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412470.116498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412470.260828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412470.387129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412470.505844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412470.631862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412470.761955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412470.909646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412471.024218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412471.154719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412471.283771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412471.396911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412471.534549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412471.659675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412471.788529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412471.913719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412472.053906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412472.180438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412472.328456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412472.438318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412472.577150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412472.703706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412472.837496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412472.966047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412473.103220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412473.225086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412473.352030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412473.482394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412473.606523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412473.721965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412473.867714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412473.980748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412474.106669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412474.235142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412474.370920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412474.492671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412474.629176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412474.767612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412474.921069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412475.028982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412475.157245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412475.272155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412475.420317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412475.519192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412475.647381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412475.773139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412475.909925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412476.043517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412476.153850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412476.296801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412476.409602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412476.534487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412476.661852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412476.789124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412476.915096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412477.037104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412477.161484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412477.283492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412477.419148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412477.536446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412477.662844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412477.787271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412477.918589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412478.040359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412478.168254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412478.321831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412478.452334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412478.597147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412478.716895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412478.838921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412478.980667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412479.101769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412479.226635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412479.365816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412479.482654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412479.602613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412479.725774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412479.859698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412480.009688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412480.161663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412480.287460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412480.426901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412480.532251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412480.666241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412480.784143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412480.901686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412481.029879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412481.179866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412481.293879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412481.409619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412481.542567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412481.660655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412481.801800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412481.949989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412482.081013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412482.240312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412482.350200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412482.574502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412482.703132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412482.847016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412482.971224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412483.106201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412483.228053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412483.371524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412483.490579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412483.620409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412483.742079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412483.894021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412484.021817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412484.163022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412484.282277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412484.415590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412484.536606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412484.664866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412484.789225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412484.919691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412485.044760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412485.166303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412485.286863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412485.416911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412485.538455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412485.666610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412485.794904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412485.917532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412486.042014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412486.169201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412486.297037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412486.429815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412486.553131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412486.696990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412486.806150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412486.929878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412487.071744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412487.232015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412487.339805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412487.465693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412487.594251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412487.725616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412487.856189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412487.982344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412488.106857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412488.244706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412488.364466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412488.519940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412488.639948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412488.781112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412488.900304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412489.047778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412489.155926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412489.284344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412489.410155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412489.542626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412489.663224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412489.793834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412489.912593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412490.062075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412490.158597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412490.296917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412490.409469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412490.545475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412490.666336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412490.801973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412490.937520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412491.068746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412491.200037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412491.331126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412491.468094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412491.602564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412491.726266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412491.852104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412491.994244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412492.123278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412492.238753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412492.367421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412492.497850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412492.633633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412492.763675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412492.902029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412493.027717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412493.152635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412493.281966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412493.414742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412493.534137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412493.670239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412493.791623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412493.930311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412494.049995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412494.177209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412494.308856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412494.446004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412494.574714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412494.705723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412494.840301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412494.974116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412495.098077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412495.234039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412495.351099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412495.481684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412495.611700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412495.732790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412495.887876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412496.032111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412496.153717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412496.281073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412496.399483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412496.534199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412496.654763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412496.786824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412496.913670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412497.040757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412497.176317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412497.307155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412497.428621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412497.559911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412497.699447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412497.844072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412497.968979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412498.117057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412498.219905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412498.352602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412498.467139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412498.612202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412498.728556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412498.848788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412498.982836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412499.114365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412499.246178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412499.388147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412499.508266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412499.652405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412499.767356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412499.903269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412500.034888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412500.166953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412500.291180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412500.417725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412500.554608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412500.671153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412500.804623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412500.937769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412501.054156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412501.219307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412501.338359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412501.469749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412501.595957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412501.721922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412501.848675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412501.977028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412502.097848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412502.229937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412502.369020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412502.494042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412502.597341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412502.725797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412502.847598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412502.978268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412503.103815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412503.235694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412503.367314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412503.492544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412503.624388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412503.748349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412503.890030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412504.016697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412504.143186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412504.284868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412504.404570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412504.534396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412504.654078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412504.776911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412504.900784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412505.040781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412505.171405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412505.295213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412505.417453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412505.547171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412505.670634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412505.809441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412505.941246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412506.082255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412506.210589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412506.334105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412506.462049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412506.601491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412506.722116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412506.854828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412506.980168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412507.135507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412507.238798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412507.368355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412507.514382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412507.653892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412507.768644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412507.907090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412508.036914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412508.164983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412508.293925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412508.439126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412508.557202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412508.702027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412508.836261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412508.964589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412509.089195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412509.222877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412509.340546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412509.474255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412509.596045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412509.730696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412509.853152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412509.975335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412510.099663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412510.223507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412510.368813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412510.485121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412510.619737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412510.740684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412510.875045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412511.012387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412511.141424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412511.282070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412511.405861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412511.536936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412511.660325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412511.792462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412511.925301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412512.039537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412512.185054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412512.306126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412512.431634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412512.563869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412512.701472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412512.829772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412512.953217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412513.086860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412513.232512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412513.351757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412513.470109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412513.607891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412513.728627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412513.855808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412513.977711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412514.105491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412514.228599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412514.365028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412514.484559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412514.615957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412514.751591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412514.889625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412515.033240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412515.157541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412515.279873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412515.413661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412515.545479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412515.667128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412515.788378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412515.930248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412516.044957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412516.181569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412516.315276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412516.452883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412516.594545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412516.716548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412516.838775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412516.963252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412517.087772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412517.222420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412517.340168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412517.467045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412517.592166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412517.724363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412517.843055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412517.969786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412518.097033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412518.218239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412518.348884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412518.476239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412518.595637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412518.745736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412518.851963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412518.974327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412519.107709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412519.240160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412519.373967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412519.506672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412519.646086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412519.773415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412519.919542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412520.033715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412520.156673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412520.285315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412520.408020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412520.541195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412520.666960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412520.794376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412520.926098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412521.052491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412521.183020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412521.322005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412521.449142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412521.580589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412521.716153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412521.849621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412521.970973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412522.099555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412522.221349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412522.351837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412522.474551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412522.603953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412522.731047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412522.869198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412522.990898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412523.139888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412523.268664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412523.405056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412523.522357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412523.650835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412523.773212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412523.913475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412524.027640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412524.165773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412524.290289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412524.432696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412524.553852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412524.677891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412524.805316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412524.943201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412525.078722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412525.206680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412525.332185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412525.465179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412525.584668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412525.712023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412525.840454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412525.993146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412526.101332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412526.219208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412526.366957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412526.496066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412526.598859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412526.729710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412526.849536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412526.974486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412527.101030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412527.226024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412527.346022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412527.472050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412527.596732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412527.726024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412527.850678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412527.990535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412528.131815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412528.252140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412528.381936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412528.515560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412528.659971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412528.783168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412528.898191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412529.036454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412529.152889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412529.284095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412529.409131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412529.537139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412529.661933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412529.784587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412529.906051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412530.038527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412530.160247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412530.291646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412530.410136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412530.539198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412530.661876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412530.796239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412530.921182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412531.062156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412531.198321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412531.340375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412531.460673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412531.596426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412531.707903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412531.838475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412531.968230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412532.107738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412532.219867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412532.354582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412532.469787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412532.600754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412532.722510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412532.848682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412532.966043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412533.102346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412533.221061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412533.344543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412533.471895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412533.595939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412533.724696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412533.849276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412533.980313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412534.098423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412534.222533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412534.346757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412534.469795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412534.599966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412534.718384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412534.847874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412534.990110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412535.098248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412535.220327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412535.349542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412535.469747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412535.591320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412535.721046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412535.849841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412535.971484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412536.101452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412536.222882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412536.349615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412536.475551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412536.603458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412536.738645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412536.850239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412536.971773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412537.098507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412537.235048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412537.350136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412537.489060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412537.599351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412537.726648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412537.870316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412537.971760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412538.098970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412538.230564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412538.362536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412538.490998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412538.613770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412538.749713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412538.882279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412539.010140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412539.136974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412539.267305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412539.391570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412539.518839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412539.640370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412539.793128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412539.917236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412540.040881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412540.172512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412540.301462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412540.450505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412540.600468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412540.741836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412540.852585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412540.974108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412541.101151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412541.225516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412541.351376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412541.477060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412541.604453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412541.741447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412541.976444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412542.366178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412542.663474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412542.977989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412543.288504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412543.478172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412543.703049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412543.918197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412544.074216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412544.277167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412544.445355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412544.594433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412544.759872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412544.971670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412545.107181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412545.259340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412545.425563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412545.605748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412545.766828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412545.965188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412546.148691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412546.325570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412546.490888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412546.725685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412546.900923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412547.073673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412547.209936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412547.372353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412547.549155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412547.778524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412547.975811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412548.111765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412548.249422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412548.455672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412548.617963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412548.785507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412548.938617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412549.105298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412549.291102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412549.467438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412549.640701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412549.816942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412549.974392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412550.135779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412550.331263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412550.483108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412550.632962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412550.859065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412551.068144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412551.296046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412551.409474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412551.536166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412551.667142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412551.788110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412551.920779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412552.051404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412552.178103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412552.302721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412552.437966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412552.570422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412552.718127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412552.848326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412552.963901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412553.092205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412553.214220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412553.348886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412553.479628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412553.608983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412553.738635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412553.870638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412554.053614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412554.257729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412554.389832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412554.499857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412554.638438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412554.774610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412554.925845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412555.046436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412555.161787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412555.287465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412555.410692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412555.540126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412555.676958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412555.803095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412555.958377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412556.089978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412556.218628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412556.348093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412556.476066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412556.598274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412556.716115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412556.846606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412556.968827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412557.104568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412557.223229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412557.357028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412557.476557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412557.595292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412557.728958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412557.871681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412558.010682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412558.129174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412558.248933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412558.383285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412558.510980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412558.644187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412558.772224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412558.903212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412559.035248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412559.155635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412559.297589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412559.434298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412559.557237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412559.703578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412559.826706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412559.968236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412560.096241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412560.217906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412560.340107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412560.466643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412560.587517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412560.725314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412560.845643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412560.969013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412561.102329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412561.236327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412561.357618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412561.484902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412561.603676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412561.753015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412561.865269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412561.994008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412562.135029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412562.274641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412562.400804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412562.529373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412562.651265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412562.779374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412562.906837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412563.032905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412563.152500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412563.279515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412563.406229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412563.533936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412563.662097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412563.808468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412563.911325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412564.042450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412564.169454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412564.288510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412564.417834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412564.568582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412564.667817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412564.801804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412564.922177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412565.056388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412565.198373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412565.324224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412565.454361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412565.577065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412565.716442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412565.851804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412565.969330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412566.099352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412566.237757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412566.380676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412566.492164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412566.617752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412566.763688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412566.892879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412567.018547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412567.156774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412567.271901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412567.407666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412567.533361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412567.660715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412567.775117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412567.908530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412568.035511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412568.160514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412568.295071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412568.412844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412568.541713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412568.658460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412568.783787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412568.913023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412569.030853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412569.156871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412569.282696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412569.426956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412569.538443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412569.681361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412569.807620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412569.951265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412570.074422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412570.206553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412570.339351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412570.463175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412570.578076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412570.718122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412570.833361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412570.972112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412571.082452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412571.220283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412571.331997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412571.467083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412571.589838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412571.722525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412571.862359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412572.015660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412572.128366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412572.258223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412572.391238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412572.525213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412572.659010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412572.783233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412572.905438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412573.031933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412573.160657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412573.288568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412573.415585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412573.540619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412573.664785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412573.809368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412573.945782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412574.090985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412574.206419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412574.336473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412574.465538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412574.593990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412574.738372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412574.850128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412574.975280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412575.085243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412575.233061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412575.351963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412575.467157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412575.603943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412575.720794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412575.870456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412575.975404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412576.111613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412576.243958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412576.384244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412576.506223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412576.657368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412576.774261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412576.910371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412577.027928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412577.159313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412577.276528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412577.406803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412577.523385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412577.660905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412577.784688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412577.911259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412578.037267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412578.164643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412578.286199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412578.415983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412578.552731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412578.674297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412578.804725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412578.927094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412579.050957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412579.181493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412579.310717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412579.451354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412579.571818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412579.717821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412579.847178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412579.963045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412580.088135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412580.224663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412580.356169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412580.476583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412580.594460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412580.726330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412580.851215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412580.992117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412581.102114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412581.234261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412581.364556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412581.497654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412581.628005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412581.771931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412581.899194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412582.024020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412582.151663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412582.293854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412582.413706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412582.555905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412582.667185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412582.801484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412582.932335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412583.052704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412583.185092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412583.324219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412583.467388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412583.584142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412583.720873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412583.851193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412583.962137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412584.105125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412584.215248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412584.349809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412584.465230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412584.597680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412584.725759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412584.863039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412584.975927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412585.107262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412585.231357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412585.358540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412585.482530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412585.623652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412585.741794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412585.883737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412586.007880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412586.137606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412586.265868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412586.409181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412586.542929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412586.650043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412586.780539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412586.906626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412587.024970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412587.162401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412587.277522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412587.433915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412587.546469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412587.676250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412587.811870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412587.929462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412588.063207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412588.201505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412588.324698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412588.467051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412588.594568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412588.724200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412588.858116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412588.974091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412589.098101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412589.246854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412589.349750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412589.475285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412589.615649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412589.730071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412589.855689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412589.996234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412590.123628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412590.263690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412590.385055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412590.548252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412590.652205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412590.782160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412590.904896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412591.035873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412591.157298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412591.294129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412591.410031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412591.536732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412591.656700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412591.799341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412591.927887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412592.057548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412592.194453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412592.320593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412592.452014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412592.591863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412592.720713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412592.845653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412592.978342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412593.100234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412593.222795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412593.368685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412593.476772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412593.601830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412593.741868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412593.867171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412593.992616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412594.134351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412594.263230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412594.420900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412594.527179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412594.663966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412594.779656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412594.911984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412595.029219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412595.158070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412595.282134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412595.405606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412595.545563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412595.662297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412595.791472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412595.918068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412596.040248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412596.184685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412596.293952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412596.413674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412596.541242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412596.667412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412596.799289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412596.926688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412597.053110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412597.185979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412597.311070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412597.471136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412597.575899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412597.733487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412597.845862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412597.980237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412598.096702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412598.226195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412598.363247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412598.488319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412598.605349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412598.729174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412598.855168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412598.989831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412599.112458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412599.238552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412599.379310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412599.515852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412599.643861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412599.785450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412599.907396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412600.041605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412600.162292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412600.288896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412600.414402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412600.540332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412600.659626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412600.789286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412600.915007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412601.047930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412601.200114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412601.325175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412601.457080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412601.586021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412601.703305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412601.864390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412601.980589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412602.115475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412602.246820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412602.385033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412602.505040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412602.630145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412602.767890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412602.904312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412603.021134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412603.151777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412603.269980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412603.404491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412603.527767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412603.664005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412603.800275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412603.927275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412604.060967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412604.177811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412604.308118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412604.441962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412604.573034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412604.706336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412604.829867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412604.962387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412605.086577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412605.223014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412605.347982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412605.470025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412605.596928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412605.730081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412605.851317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412605.965306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412606.103265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412606.224557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412606.350435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412606.488169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412606.618680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412606.746363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412606.887740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412607.014646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412607.141849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412607.292254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412607.420316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412607.548679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412607.680874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412607.824396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412607.952821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412608.090006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412608.206790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412608.340959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412608.470006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412608.594010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412608.719688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412608.850343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412608.969482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412609.105204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412609.223422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412609.351855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412609.469106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412609.598625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412609.724602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412609.852815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412609.978797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412610.105269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412610.230810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412610.364687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412610.491864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412610.641764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412610.764477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412610.910419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412611.037015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412611.157636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412611.288575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412611.413235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412611.537005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412611.668408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412611.798513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412611.929006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412612.063602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412612.202684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412612.331364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412612.473635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412612.584350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412612.721067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412612.839404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412612.964223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412613.094823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412613.224955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412613.345615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412613.478265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412613.601794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412613.725324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412613.866116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412613.987201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412614.112366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412614.242319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412614.387824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412614.505086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412614.639987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412614.773204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412614.903896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412615.032452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412615.155967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412615.290860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412615.400013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412615.537167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412615.663769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412615.790437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412615.950777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412616.082412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412616.205808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412616.346738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412616.459165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412616.591154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412616.713978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412616.845689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412616.969893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412617.097854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412617.227089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412617.365369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412617.479244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412617.610021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412617.732479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412617.862492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412617.994629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412618.145317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412618.263783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412618.402925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412618.522493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412618.662847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412618.780429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412618.902193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412619.042647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412619.154498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412619.279965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412619.409587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412619.537212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412619.696922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412619.791973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412619.928795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412620.069742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412620.215243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412620.344357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412620.472572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412620.615362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412620.743494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412620.851263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412620.981291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412621.102581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412621.238493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412621.366387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412621.510130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412621.641475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412621.773033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412621.908320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412622.038961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412622.160351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412622.289460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412622.406845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412622.553446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412622.655086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412622.784968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412622.906251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412623.029294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412623.155536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412623.283822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412623.409795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412623.536536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412623.659151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412623.788754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412623.928062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412624.043068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412624.164426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412624.290953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412624.405113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412624.534413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412624.656496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412624.781919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412624.909310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412625.047717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412625.148207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412625.299850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412625.429427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412625.544801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412625.668252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412625.793831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412625.926844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412626.047973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412626.182715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412626.326641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412626.444486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412626.582016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412626.707200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412626.839089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412626.967673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412627.095655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412627.215823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412627.340841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412627.460350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412627.590476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412627.703610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412627.828643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412627.958346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412628.097455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412628.219932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412628.356055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412628.486450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412628.601127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412628.727741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412628.854197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412628.977819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412629.121276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412629.234695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412629.370226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412629.499749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412629.638810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412629.771440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412629.904989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412630.031852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412630.161774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412630.287980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412630.409469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412630.536355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412630.672473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412630.789860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412630.923103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412631.061557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412631.177974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412631.294279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412631.428501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412631.574470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412631.714418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412631.831335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412631.984248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412632.096306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412632.225747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412632.359490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412632.475357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412632.602996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412632.732192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412632.861533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412632.992092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412633.117151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412633.247463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412633.376910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412633.512137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412633.635859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412633.778744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412633.922629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412634.051176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412634.154187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412634.290296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412634.416711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412634.546563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412634.669360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412634.806809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412634.934703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412635.077313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412635.207947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412635.353566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412635.458823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412635.593829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412635.709617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412635.843823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412635.967920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412636.094148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412636.213073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412636.358024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412636.476027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412636.604349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412636.729250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412636.862754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412637.008786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412637.135718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412637.261083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412637.410172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412637.524491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412637.657579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412637.796417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412637.923881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412638.050143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412638.175287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412638.289425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412638.423022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412638.549307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412638.676431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412638.818756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412638.948947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412639.082404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412639.219683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412639.361401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412639.473490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412639.611603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412639.737193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412639.847327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412639.971997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412640.095040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412640.225787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412640.346425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412640.487718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412640.609466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412640.727141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412640.861767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412640.996406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412641.132401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412641.273866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412641.399429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412641.533463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412641.653285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412641.789150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412641.904963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412642.028428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412642.154822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412642.287367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412642.403538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412642.549814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412642.677706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412642.806641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412642.945906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412643.069362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412643.201571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412643.334256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412643.468018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412643.595374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412643.736026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412643.849974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412643.972692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412644.103469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412644.225311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412644.369459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412644.489741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412644.620739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412644.759743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412644.885504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412645.033295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412645.140754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412645.262477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412645.402567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412645.532059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412645.652965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412645.774813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412645.902856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412646.029193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412646.156564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412646.280059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412646.410416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412646.530718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412646.676818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412646.785283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412646.917439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412647.037218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412647.164873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412647.309675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412647.419831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412647.549833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412647.675168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412647.814160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412647.934224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412648.071580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412648.209100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412648.336920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412648.486109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412648.589204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412648.726040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412648.872187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412648.990017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412649.136142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412649.239713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412649.382682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412649.511689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412649.647517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412649.793893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412649.901758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412650.033681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412650.157237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412650.280260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412650.405146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412650.533701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412650.666654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412650.782594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412650.900989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412651.030922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412651.156931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412651.279104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412651.400916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412651.534385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412651.655946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412651.783861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412651.908813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412652.043300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412652.162189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412652.285813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412652.408623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412652.540802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412652.661911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412652.786101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412652.909315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412653.045870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412653.177711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412653.309360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412653.441483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412653.583275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412653.704801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412653.842717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412653.959696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412654.094566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412654.225762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412654.344246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412654.465713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412654.593631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412654.715631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412654.862258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412654.966323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412655.099526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412655.219434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412655.349356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412655.471256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412655.593580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412655.739768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412655.851362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412655.975865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412656.108876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412656.236796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412656.384003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412656.495268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412656.653050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412656.772716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412656.905413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412657.031860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412657.173216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412657.276071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412657.409518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412657.553055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412657.663011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412657.787958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412657.922938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412658.063273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412658.204542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412658.331495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412658.465450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412658.576186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412658.713128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412658.829285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412658.967676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412659.086588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412659.226974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412659.371421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412659.513905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412659.648090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412659.777598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412659.907691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412660.036741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412660.161585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412660.300786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412660.409626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412660.549675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412660.674258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412660.814264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412660.947251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412661.069969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412661.203905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412661.338626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412661.458009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412661.589507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412661.716759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412661.867747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412662.074695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412662.475475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412662.736676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412663.148816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412663.463550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412663.643975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412663.862609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412664.078285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412664.228015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412664.408943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412664.547440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412664.760482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412664.916162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412665.081008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412665.279004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412665.433750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412665.650112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412665.785641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412665.998144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412666.126717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412666.291707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412666.466281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412666.639763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412666.864113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412667.042836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412667.224437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412667.354189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412667.547664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412667.814925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412668.060292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412668.198198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412668.339945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412668.483893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412668.660993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412668.818661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412668.965412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412669.154290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412669.348012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412669.492440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412669.698361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412669.881796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412670.030795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412670.195222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412670.363286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412670.546445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412670.724973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412670.881204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412671.108594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412671.409531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412671.585476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412671.720836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412671.833898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412671.971441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412672.096260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412672.223704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412672.345663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412672.473651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412672.612242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412672.727710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412672.858862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412672.986722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412673.110312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412673.247269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412673.370224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412673.489657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412673.619669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412673.768799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412673.893893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412674.028748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412674.178239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412674.398492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412674.531375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412674.648335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412674.769277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412674.897151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412675.032835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412675.153712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412675.272711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412675.401179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412675.536941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412675.666615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412675.793120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412675.936141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412676.075617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412676.201819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412676.325449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412676.455322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412676.585494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412676.725309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412676.858293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412676.973888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412677.098277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412677.228187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412677.346475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412677.475321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412677.600990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412677.739466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412677.855479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412677.984869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412678.117625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412678.258103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412678.385622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412678.512159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412678.650289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412678.771766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412678.896182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412679.022391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412679.149758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412679.275471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412679.429718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412679.545905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412679.674223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412679.806619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412679.937138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412680.082783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412680.211812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412680.341069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412680.461413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412680.590585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412680.718371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412680.848841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412680.974255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412681.110476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412681.236769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412681.374189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412681.486545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412681.615258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412681.741893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412681.884839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412682.017283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412682.150929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412682.272002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412682.401932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412682.540862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412682.660646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412682.786776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412682.911902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412683.037480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412683.179781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412683.279336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412683.412698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412683.531137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412683.676447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412683.800551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412683.933666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412684.046039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412684.175566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412684.305302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412684.443470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412684.558032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412684.693793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412684.824547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412684.963805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412685.093812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412685.220295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412685.340596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412685.469523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412685.590941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412685.717290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412685.841999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412685.969712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412686.096047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412686.260590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412686.507925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412686.655763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412686.779159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412686.906653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412687.023004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412687.149879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412687.280320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412687.403912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412687.547400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412687.656359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412687.789636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412687.908848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412688.041702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412688.158514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412688.301300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412688.428210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412688.567120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412688.693629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412688.827642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412688.962960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412689.088844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412689.223579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412689.350488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412689.462476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412689.588191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412689.716000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412689.860301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412689.971709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412690.135913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412690.235754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412690.369521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412690.488388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412690.633350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412690.759346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412690.888768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412691.017182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412691.153648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412691.275387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412691.409946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412691.524805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412691.659406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412691.787414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412691.947998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412692.076708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412692.211969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412692.347412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412692.474314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412692.598828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412692.748705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412692.863952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412692.994048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412693.132291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412693.254105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412693.400953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412693.541922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412693.643560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412693.769830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412693.905688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412694.039347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412694.182290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412694.296631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412694.423574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412694.561220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412694.696691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412694.825025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412694.959027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412695.093112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412695.212209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412695.341735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412695.465647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412695.591487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412695.715962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412695.855104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412695.965731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412696.091356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412696.220462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412696.345675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412696.472682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412696.598412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412696.718753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412696.851720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412696.977142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412697.127317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412697.230562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412697.367862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412697.485080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412697.621018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412697.759181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412697.884968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412698.014261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412698.152117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412698.269769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412698.421136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412698.531558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412698.661184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412698.786186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412698.929355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412699.049470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412699.183864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412699.304197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412699.440536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412699.554313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412699.674890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412699.831713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412699.956890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412700.079712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412700.218694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412700.337363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412700.460700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412700.582149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412700.715698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412700.836167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412700.973532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412701.099614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412701.233816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412701.353197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412701.485153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412701.611278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412701.756210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412701.891586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412702.021109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412702.144585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412702.295629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412702.404373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412702.534829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412702.654179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412702.784922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412702.914551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412703.029884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412703.155113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412703.285671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412703.407713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412703.537083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412703.660241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412703.788506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412703.914932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412704.061816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412704.171212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412704.300373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412704.430744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412704.555089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412704.689373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412704.827100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412704.966445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412705.093609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412705.217996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412705.347243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412705.470839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412705.605137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412705.720597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412705.851397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412705.970899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412706.110987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412706.235344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412706.370865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412706.503948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412706.649228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412706.763772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412706.897152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412707.024957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412707.159499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412707.282412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412707.412769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412707.529059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412707.666654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412707.782471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412707.931048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412708.038777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412708.165124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412708.299372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412708.422643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412708.547508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412708.688726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412708.834600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412708.939763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412709.079280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412709.206717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412709.333646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412709.464852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412709.586306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412709.716404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412709.843418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412709.965191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412710.094289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412710.223200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412710.350051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412710.480503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412710.605457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412710.745619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412710.865512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412711.001833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412711.137177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412711.282734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412711.413642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412711.531887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412711.657696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412711.792640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412711.911597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412712.043395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412712.171428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412712.290112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412712.416225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412712.542939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412712.669961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412712.797878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412712.929297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412713.070349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412713.202192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412713.339003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412713.465912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412713.594889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412713.731611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412713.859921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412713.969494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412714.104932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412714.219777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412714.347930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412714.471222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412714.615687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412714.719843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412714.854087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412714.995092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412715.127286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412715.257720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412715.385064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412715.510774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412715.649900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412715.774269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412715.904649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412716.019994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412716.151227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412716.275701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412716.412193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412716.533997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412716.661880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412716.792907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412716.914746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412717.035543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412717.170461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412717.290135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412717.421911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412717.550848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412717.687524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412717.820720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412717.949314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412718.081516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412718.212954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412718.355541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412718.466644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412718.587295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412718.721340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412718.841631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412718.969106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412719.096024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412719.225987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412719.364766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412719.478012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412719.600439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412719.725962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412719.870544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412720.010814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412720.143806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412720.277870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412720.398659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412720.527076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412720.657666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412720.784344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412720.922322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412721.037718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412721.174780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412721.296814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412721.423447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412721.589199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412721.722153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412721.861767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412722.009935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412722.155448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412722.269574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412722.402687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412722.521716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412722.659228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412722.774073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412722.899498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412723.035781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412723.222080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412723.351183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412723.487164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412723.631222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412723.777697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412723.905113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412724.030620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412724.170645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412724.300321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412724.401322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412724.561475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412724.666086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412724.807312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412724.927451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412725.054723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412725.199910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412725.334769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412725.457900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412725.584272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412725.710043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412725.840224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412725.963057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412726.096036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412726.211329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412726.344835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412726.461898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412726.588402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412726.712975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412726.854684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412726.966387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412727.094751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412727.222702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412727.352968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412727.492480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412727.619690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412727.740623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412727.884531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412728.017364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412728.147439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412728.266631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412728.398643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412728.527315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412728.657363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412728.786113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412728.915262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412729.041540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412729.172295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412729.304793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412729.463641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412729.570682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412729.698518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412729.829258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412729.956354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412730.086792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412730.213442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412730.335446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412730.467745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412730.595118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412730.722912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412730.872563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412730.994598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412731.131793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412731.258972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412731.402721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412731.532005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412731.670841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412731.776774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412731.900519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412732.031976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412732.172978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412732.280153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412732.407529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412732.535307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412732.661139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412732.791307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412732.926396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412733.052055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412733.171082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412733.295646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412733.431216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412733.570734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412733.704440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412733.837310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412733.964805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412734.095667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412734.214409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412734.342313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412734.471565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412734.597594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412734.717775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412734.850083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412734.960637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412735.107989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412735.217469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412735.355958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412735.471955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412735.607498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412735.723082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412735.891531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412736.015395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412736.143926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412736.273837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412736.411094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412736.531302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412736.659942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412736.801111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412736.914189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412737.049678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412737.169882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412737.295934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412737.431536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412737.571657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412737.711181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412737.834205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412737.964681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412738.090371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412738.220922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412738.361158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412738.468131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412738.593367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412738.725412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412738.858291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412738.970628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412739.100896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412739.229666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412739.353644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412739.491735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412739.615195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412739.741827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412739.873998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412740.015133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412740.150281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412740.289581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412740.397921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412740.526725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412740.655307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412740.779784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412740.896790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412741.037344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412741.155201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412741.281756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412741.407671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412741.537963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412741.666548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412741.817858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412741.947487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412742.067270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412742.197188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412742.324881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412742.459797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412742.595427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412742.731237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412742.844828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412742.977342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412743.099327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412743.236473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412743.342239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412743.467933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412743.598116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412743.715692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412743.848497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412743.972197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412744.104292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412744.254096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412744.363937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412744.501186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412744.632864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412744.768947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412744.896213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412745.021327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412745.154375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412745.277452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412745.404525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412745.529717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412745.652932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412745.780257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412745.907685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412746.032597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412746.156666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412746.283693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412746.412099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412746.547496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412746.676661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412746.813740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412746.966370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412747.088587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412747.217241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412747.344848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412747.486844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412747.585257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412747.712587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412747.849079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412747.982257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412748.108517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412748.256789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412748.383224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412748.528033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412748.640187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412748.776166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412748.902849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412749.025588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412749.150222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412749.279732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412749.402870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412749.531373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412749.652284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412749.779246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412749.907937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412750.030313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412750.164102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412750.276967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412750.403491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412750.543710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412750.661860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412750.788019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412750.920622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412751.056124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412751.190341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412751.317653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412751.445639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412751.587519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412751.704347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412751.853213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412751.982619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412752.107601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412752.238758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412752.371298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412752.503667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412752.649162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412752.770226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412752.892787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412753.030467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412753.156734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412753.279723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412753.410096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412753.532084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412753.662265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412753.788645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412753.915066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412754.050359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412754.178988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412754.310094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412754.442719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412754.568289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412754.713215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412754.828233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412754.958081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412755.079356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412755.215088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412755.342209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412755.463715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412755.587721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412755.733297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412755.842242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412755.970961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412756.100499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412756.237229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412756.370469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412756.505892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412756.653226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412756.781838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412756.893733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412757.026332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412757.149460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412757.279680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412757.399516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412757.544617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412757.651502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412757.782825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412757.908398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412758.035406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412758.159669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412758.292769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412758.417558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412758.555691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412758.679050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412758.816071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412758.942389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412759.091260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412759.201882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412759.329360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412759.456703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412759.586780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412759.716884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412759.846638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412759.970827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412760.107476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412760.238426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412760.380074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412760.505533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412760.637471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412760.762527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412760.891085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412761.010370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412761.152493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412761.278524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412761.406882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412761.529727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412761.671318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412761.787456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412761.931295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412762.046379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412762.185256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412762.306592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412762.460601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412762.584032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412762.713179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412762.853785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412762.983003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412763.089441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412763.218847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412763.345746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412763.476688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412763.607537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412763.746500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412763.884101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412764.021887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412764.139765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412764.271223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412764.394487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412764.520580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412764.649919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412764.791303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412764.907819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412765.034291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412765.176738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412765.294932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412765.419564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412765.545323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412765.674546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412765.819895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412765.943395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412766.074292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412766.202562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412766.346827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412766.468070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412766.592705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412766.714724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412766.847129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412766.968398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412767.093920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412767.222196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412767.356272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412767.501436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412767.628174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412767.768366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412767.896770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412768.041250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412768.156516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412768.276201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412768.397141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412768.521830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412768.655929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412768.785969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412768.919508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412769.036865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412769.176258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412769.317642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412769.453402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412769.588442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412769.717646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412769.839604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412769.966326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412770.096671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412770.232739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412770.358380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412770.492255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412770.633865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412770.768907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412770.899650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412771.032483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412771.155713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412771.283415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412771.413951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412771.548621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412771.675017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412771.809183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412771.951166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412772.084798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412772.207628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412772.332815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412772.469747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412772.595577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412772.722778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412772.853577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412772.972307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412773.104983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412773.231529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412773.373010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412773.498176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412773.635809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412773.767787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412773.902848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412774.019195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412774.150728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412774.295199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412774.422372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412774.525347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412774.661907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412774.782266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412774.910218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412775.040799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412775.158669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412775.283943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412775.413029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412775.532282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412775.672547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412775.782500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412775.908424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412776.034664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412776.174608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412776.296626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412776.425217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412776.561601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412776.694355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412776.820915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412776.961033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412777.107455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412777.251388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412777.382608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412777.508138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412777.642476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412777.757938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412777.890079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412778.023443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412778.149558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412778.270983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412778.390776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412778.526188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412778.669360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412778.776651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412778.894861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412779.026003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412779.152616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412779.277833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412779.405284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412779.526863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412779.664413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412779.781247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412779.920957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412780.048502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412780.202361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412780.319504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412780.448597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412780.579999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412780.706165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412780.848431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412780.960052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412781.105700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412781.239894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412781.357414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412781.480518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412781.605109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412781.746755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412781.910709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412782.034768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412782.195971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412782.440951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412782.794473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412783.090156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412783.484549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412783.678148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412783.913079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412784.143363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412784.296188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412784.457937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412784.654324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412784.808367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412784.970781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412785.155869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412785.323714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412785.483524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412785.667732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412785.834784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412786.017044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412786.200061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412786.399379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412786.550465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412786.777829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412786.919426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412787.095583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412787.267877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412787.465343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412787.611176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412787.888128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412788.089010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412788.217964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412788.361325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412788.510177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412788.660066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412788.874715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412789.031265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412789.204191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412789.390058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412789.530730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412789.718083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412789.879327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412790.052856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412790.229705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412790.422293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412790.575486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412790.733697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412790.933649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412791.157149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412791.410455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412791.555292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412791.696854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412791.831091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412791.953869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412792.078406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412792.207626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412792.329553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412792.456390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412792.586209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412792.710686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412792.826940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412792.962744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412793.077942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412793.210678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412793.338094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412793.482471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412793.584152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412793.748728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412793.848959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412793.973309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412794.106673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412794.349281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412794.498632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412794.632767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412794.757990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412794.882257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412795.009016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412795.134664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412795.269327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412795.401174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412795.525910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412795.649177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412795.774731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412795.918579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412796.046122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412796.193799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412796.315461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412796.438059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412796.568953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412796.693796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412796.829103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412796.963862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412797.081838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412797.209121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412797.330538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412797.461150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412797.585788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412797.729144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412797.831160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412797.963512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412798.089190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412798.220901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412798.349943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412798.481301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412798.615818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412798.760228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412798.883221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412799.011853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412799.132811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412799.277503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412799.400923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412799.538280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412799.661841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412799.790506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412799.934986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412800.063472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412800.195016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412800.334934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412800.454334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412800.588421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412800.719480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412800.842293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412800.961181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412801.101254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412801.221115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412801.341359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412801.461069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412801.597651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412801.717100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412801.844419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412801.969550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412802.106214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412802.219922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412802.352443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412802.487006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412802.632120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412802.765218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412802.883763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412803.020388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412803.139547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412803.267119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412803.400483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412803.527219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412803.668898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412803.774438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412803.903946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412804.038158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412804.160800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412804.280443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412804.407399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412804.529894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412804.661361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412804.789150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412804.921110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412805.047410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412805.182843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412805.312105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412805.444840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412805.568090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412805.710236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412805.839483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412805.954666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412806.084148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412806.216646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412806.342048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412806.472444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412806.604420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412806.734584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412806.859120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412806.994916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412807.122174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412807.257145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412807.366626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412807.514540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412807.634260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412807.764714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412807.892681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412808.043125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412808.146533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412808.282210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412808.402277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412808.530967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412808.656741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412808.786279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412808.905975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412809.039988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412809.162937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412809.311288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412809.422654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412809.573443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412809.688533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412809.822556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412809.938047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412810.074230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412810.205423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412810.339975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412810.463721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412810.607018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412810.715604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412810.846925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412810.968783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412811.099784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412811.220398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412811.348686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412811.484309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412811.605476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412811.740254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412811.906228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412812.027203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412812.155521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412812.277022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412812.409156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412812.543978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412812.676750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412812.814942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412812.946520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412813.079470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412813.227237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412813.339019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412813.472307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412813.591561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412813.722869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412813.850423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412813.976459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412814.108923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412814.245137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412814.365549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412814.521017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412814.648153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412814.784741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412814.902158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412815.030974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412815.152032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412815.276636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412815.393208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412815.526262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412815.649327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412815.777245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412815.897096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412816.028383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412816.166220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412816.292917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412816.400719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412816.537228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412816.659420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412816.786319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412816.908082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412817.033320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412817.161847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412817.285985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412817.414212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412817.543384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412817.685782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412817.815071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412817.938481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412818.079674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412818.209609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412818.332737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412818.457012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412818.585863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412818.715295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412818.841916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412818.962072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412819.109048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412819.218115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412819.350973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412819.470790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412819.603365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412819.734536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412819.868974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412820.011735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412820.139157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412820.267699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412820.400722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412820.519780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412820.653491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412820.774223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412820.903263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412821.032380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412821.151540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412821.280183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412821.404437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412821.534775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412821.666216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412821.785526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412821.920897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412822.052631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412822.193143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412822.310312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412822.448164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412822.578526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412822.715311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412822.843235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412822.968194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412823.097283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412823.224025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412823.347492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412823.480193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412823.601051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412823.738767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412823.878488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412824.002625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412824.128461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412824.257099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412824.392025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412824.509225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412824.646691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412824.777726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412824.899593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412825.025751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412825.151417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412825.276959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412825.396850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412825.531790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412825.643538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412825.773048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412825.896517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412826.022181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412826.148861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412826.276069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412826.396730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412826.529165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412826.650484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412826.779587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412826.904051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412827.034026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412827.155297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412827.287585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412827.424664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412827.543324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412827.669273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412827.798594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412827.923389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412828.061508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412828.186704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412828.326306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412828.452551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412828.586350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412828.711861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412828.834037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412828.952888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412829.087982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412829.207357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412829.334506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412829.457485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412829.589347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412829.702765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412829.839287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412829.962446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412830.096075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412830.213027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412830.356379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412830.463422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412830.586545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412830.717668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412830.859127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412830.976219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412831.108542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412831.239717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412831.381611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412831.508564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412831.647074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412831.766460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412831.904355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412832.025609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412832.157734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412832.292613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412832.405191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412832.544346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412832.668708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412832.809189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412832.940591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412833.069737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412833.210951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412833.340670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412833.463965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412833.587150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412833.716349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412833.833519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412833.962881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412834.089159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412834.221374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412834.344660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412834.469606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412834.599974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412834.736190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412834.856805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412834.997304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412835.117157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412835.266779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412835.388601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412835.514640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412835.641075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412835.775556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412835.892729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412836.023602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412836.145570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412836.278222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412836.399638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412836.521214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412836.649683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412836.780724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412836.902047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412837.029488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412837.159448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412837.284603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412837.412990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412837.543003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412837.659557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412837.792038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412837.923553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412838.064855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412838.199095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412838.333926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412838.459719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412838.594559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412838.718413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412838.861124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412838.985289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412839.124422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412839.229219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412839.426499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412839.545751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412839.658382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412839.788574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412839.942860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412840.063259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412840.194031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412840.319839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412840.453906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412840.599765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412840.732102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412840.843234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412840.969030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412841.102726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412841.226300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412841.363999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412841.498732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412841.635685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412841.753094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412841.896351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412842.028621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412842.153337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412842.276834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412842.414110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412842.538246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412842.653742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412842.791022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412842.912580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412843.058732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412843.185037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412843.317917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412843.456099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412843.589042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412843.714939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412843.866091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412843.984182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412844.115390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412844.248174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412844.380988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412844.509273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412844.644217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412844.769936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412844.895472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412845.017274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412845.151591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412845.279347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412845.411699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412845.529310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412845.690666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412845.795529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412845.937687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412846.055239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412846.194903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412846.326038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412846.457650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412846.582308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412846.714194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412846.840593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412846.966100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412847.086096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412847.213131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412847.336237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412847.460714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412847.587307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412847.722920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412847.857318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412847.995814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412848.128616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412848.257460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412848.392593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412848.519525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412848.641997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412848.772874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412848.911664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412849.037890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412849.151200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412849.314855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412849.401699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412849.532317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412849.659321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412849.794836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412849.921569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412850.042515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412850.167869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412850.307667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412850.430253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412850.566530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412850.722019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412850.854996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412850.987891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412851.108431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412851.234998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412851.360063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412851.493425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412851.631665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412851.756535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412851.898871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412852.020617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412852.143494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412852.262135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412852.396067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412852.518777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412852.647724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412852.768499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412852.899127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412853.020216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412853.148154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412853.296935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412853.407838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412853.530375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412853.655897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412853.792404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412853.938290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412854.063580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412854.185441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412854.317863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412854.442675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412854.575969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412854.709044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412854.825195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412854.954402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412855.072502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412855.198357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412855.333207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412855.459482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412855.602633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412855.722571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412855.849815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412855.997830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412856.128852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412856.275511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412856.387686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412856.521912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412856.645366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412856.775653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412856.904941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412857.025880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412857.148351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412857.276643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412857.402810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412857.526305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412857.667764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412857.779277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412857.903468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412858.027648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412858.167418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412858.282622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412858.415292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412858.542059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412858.669528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412858.808848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412858.940717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412859.078534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412859.201928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412859.332909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412859.454592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412859.587952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412859.704466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412859.829932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412859.962790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412860.090641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412860.212591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412860.340031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412860.460608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412860.588625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412860.715326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412860.842816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412860.960667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412861.091737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412861.216382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412861.339943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412861.458099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412861.590901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412861.709820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412861.840785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412861.961801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412862.092151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412862.216612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412862.353868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412862.483443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412862.622530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412862.753670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412862.915945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412863.025895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412863.147854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412863.269935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412863.399713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412863.528126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412863.672783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412863.784928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412863.916585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412864.051665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412864.175554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412864.316779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412864.471329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412864.613825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412864.770186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412864.888097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412865.040499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412865.137279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412865.278471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412865.403005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412865.531477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412865.651035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412865.779328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412865.909574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412866.032995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412866.155885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412866.282744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412866.408834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412866.537263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412866.668173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412866.811086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412866.924999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412867.072541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412867.189984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412867.323451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412867.455921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412867.602752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412867.721033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412867.857719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412867.985417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412868.129979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412868.261051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412868.390911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412868.510056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412868.660743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412868.766523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412868.894587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412869.021155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412869.145406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412869.273407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412869.401646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412869.521828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412869.653246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412869.773318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412869.904659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412870.042510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412870.164699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412870.301136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412870.418516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412870.557266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412870.692433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412870.830511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412870.958080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412871.080919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412871.213184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412871.342830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412871.462195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412871.584251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412871.719703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412871.854527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412871.989953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412872.118796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412872.236932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412872.373777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412872.521949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412872.651402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412872.786974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412872.911140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412873.045723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412873.184150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412873.315527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412873.453505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412873.611693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412873.716266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412873.845648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412873.963662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412874.093042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412874.214283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412874.342462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412874.460817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412874.594131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412874.714996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412874.854001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412874.972507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412875.108639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412875.241348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412875.371546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412875.499653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412875.630118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412875.763185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412875.907995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412876.041955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412876.159806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412876.276686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412876.404955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412876.525132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412876.651953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412876.775576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412876.905032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412877.029637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412877.155499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412877.282197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412877.411096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412877.537819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412877.687916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412877.799812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412877.938350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412878.065657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412878.207419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412878.323987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412878.452116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412878.573748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412878.704434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412878.824813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412878.980284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412879.086094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412879.222060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412879.341192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412879.471444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412879.603064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412879.732994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412879.848585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412879.980936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412880.105809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412880.251286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412880.380488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412880.509183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412880.634853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412880.779263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412880.903462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412881.027512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412881.173718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412881.283512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412881.419716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412881.542420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412881.668377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412881.810467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412881.948000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412882.078409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412882.208235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412882.353694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412882.452931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412882.588094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412882.709927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412882.867496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412882.957970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412883.087512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412883.206051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412883.342674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412883.468022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412883.582068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412883.711013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412883.855963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412883.965596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412884.098231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412884.214125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412884.345091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412884.466415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412884.589284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412884.712093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412884.842407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412884.960961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412885.088646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412885.212056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412885.363970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412885.462863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412885.598631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412885.720598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412885.849337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412885.972801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412886.104750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412886.237769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412886.362352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412886.503586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412886.614167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412886.752828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412886.880220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412887.011408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412887.146858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412887.279525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412887.402035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412887.537200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412887.669843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412887.791242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412887.926854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412888.044491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412888.167155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412888.302863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412888.442023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412888.568025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412888.697328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412888.829056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412888.977285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412889.086751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412889.216477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412889.344373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412889.470020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412889.591870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412889.722990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412889.849660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412889.985047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412890.117747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412890.252564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412890.380512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412890.511992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412890.645329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412890.777085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412890.899328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412891.030460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412891.158157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412891.277505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412891.403691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412891.531492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412891.682255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412891.816571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412891.934286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412892.060264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412892.202028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412892.327089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412892.456878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412892.590400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412892.729509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412892.841034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412892.964102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412893.089683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412893.212295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412893.340119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412893.461880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412893.588025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412893.721512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412893.846108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412893.969854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412894.110805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412894.226798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412894.364660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412894.505054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412894.628798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412894.762463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412894.899642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412895.016228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412895.149928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412895.274041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412895.400783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412895.520892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412895.673304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412895.782329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412895.912338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412896.027312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412896.147858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412896.281706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412896.411458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412896.536567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412896.660097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412896.812497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412896.938303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412897.050861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412897.185461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412897.324998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412897.453054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412897.573631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412897.704224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412897.837503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412897.962458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412898.083206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412898.222547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412898.333308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412898.463668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412898.587712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412898.706649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412898.854545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412898.965278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412899.094688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412899.222073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412899.344484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412899.470165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412899.599308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412899.728956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412899.876687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412900.012404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412900.135585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412900.265924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412900.389828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412900.522816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412900.639505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412900.777706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412900.898262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412901.022615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412901.150609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412901.277492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412901.404681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412901.528553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412901.649895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412901.777639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412901.939461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412902.084354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412902.219685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412902.339088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412902.464375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412902.602758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412902.911881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412903.212101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412903.625202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412903.948203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412904.146315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412904.284561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412904.521176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412904.693363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412904.893088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412905.040095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412905.208896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412905.375236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412905.558507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412905.703084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412905.857654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412906.040777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412906.208104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412906.423181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412906.542749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412906.747078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412906.878030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412907.060072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412907.216242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412907.418639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412907.615635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412907.903400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412908.071514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412908.218684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412908.418421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412908.578920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412908.761422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412909.005285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412909.260648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412909.395714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412909.879695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412910.092178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412910.292182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412910.517891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412910.664570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412910.839398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412911.016963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412911.188462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412911.352988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412911.534229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412911.696311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412911.902785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412912.054059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412912.238197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412912.468654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412912.789912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412912.926744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412913.057584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412913.185033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412913.337659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412913.460641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412913.595174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412913.709569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412913.838795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412913.960097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412914.105731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412914.212377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412914.351003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412914.473011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412914.606698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412914.728680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412914.874164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412914.998698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412915.136997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412915.259234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412915.388465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412915.529091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412915.746495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412915.895686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412916.020340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412916.139408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412916.278413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412916.391940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412916.523052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412916.643932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412916.776974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412916.901494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412917.024835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412917.158119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412917.279989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412917.418659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412917.528217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412917.648446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412917.773427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412917.893566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412918.027153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412918.167237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412918.277529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412918.398823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412918.526294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412918.658553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412918.794037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412918.902079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412919.023739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412919.155120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412919.281055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412919.408333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412919.535794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412919.664368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412919.790257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412919.931865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412920.064640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412920.197938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412920.332722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412920.451388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412920.579370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412920.703814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412920.853228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412920.982006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412921.111607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412921.251311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412921.378761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412921.512646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412921.635134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412921.763703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412921.892916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412922.021372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412922.150484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412922.273914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412922.400639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412922.520464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412922.645528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412922.773494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412922.897318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412923.022604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412923.152067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412923.278394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412923.419439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412923.542524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412923.671450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412923.810456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412923.945886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412924.070026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412924.204393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412924.326241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412924.464723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412924.581619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412924.711449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412924.835277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412924.963037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412925.091045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412925.236370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412925.340773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412925.471884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412925.604532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412925.736601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412925.856579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412925.987046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412926.107327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412926.246201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412926.356042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412926.505069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412926.633435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412926.758403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412926.885531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412927.014905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412927.133687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412927.269245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412927.387829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412927.517769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412927.643237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412927.773251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412927.902030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412928.031483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412928.151615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412928.296869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412928.406657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412928.532592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412928.663710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412928.805841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412928.919818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412929.063637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412929.202225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412929.345643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412929.471128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412929.593425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412929.710940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412929.840981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412929.961664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412930.087070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412930.210019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412930.335432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412930.452880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412930.579917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412930.706572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412930.839293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412930.951899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412931.080911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412931.207816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412931.336592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412931.466396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412931.593554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412931.714405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412931.871142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412932.000067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412932.128151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412932.256864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412932.384593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412932.515414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412932.641200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412932.770533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412932.894458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412933.021493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412933.147920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412933.284043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412933.399210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412933.519908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412933.653325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412933.774513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412933.906769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412934.030472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412934.157655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412934.279740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412934.409056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412934.534762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412934.680583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412934.813305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412934.940546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412935.075735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412935.206891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412935.327604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412935.457780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412935.581429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412935.712257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412935.835912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412935.965219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412936.085094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412936.217874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412936.341109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412936.465619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412936.603731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412936.730798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412936.845681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412936.975751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412937.103921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412937.255160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412937.371035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412937.503090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412937.631312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412937.773017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412937.891457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412938.015518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412938.155361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412938.275938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412938.396260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412938.527662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412938.646246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412938.778639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412938.901983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412939.042542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412939.164618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412939.301744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412939.437124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412939.565051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412939.698445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412939.832875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412939.960715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412940.083915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412940.212027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412940.338032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412940.460258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412940.582376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412940.715852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412940.841438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412940.963104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412941.088618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412941.210933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412941.338265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412941.482197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412941.592897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412941.717206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412941.852524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412941.981555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412942.138945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412942.244646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412942.389756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412942.510255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412942.635046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412942.760441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412942.891927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412943.015560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412943.147335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412943.284149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412943.393039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412943.524224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412943.651590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412943.768333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412943.903151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412944.028547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412944.154174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412944.275173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412944.419759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412944.533044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412944.669896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412944.790571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412944.935540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412945.050304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412945.188905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412945.310524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412945.458963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412945.579113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412945.710797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412945.835225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412945.962777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412946.085321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412946.212632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412946.334506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412946.468372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412946.609053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412946.722347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412946.845745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412946.980039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412947.103684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412947.235944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412947.372431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412947.494722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412947.629621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412947.766938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412947.884115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412948.025202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412948.151468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412948.267612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412948.398226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412948.530841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412948.647313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412948.775121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412948.899409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412949.032904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412949.143533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412949.271070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412949.415722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412949.525338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412949.656575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412949.784071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412949.907897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412950.044173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412950.172350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412950.303915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412950.437975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412950.574147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412950.698809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412950.851211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412950.954433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412951.076544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412951.206997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412951.337681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412951.452154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412951.588502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412951.717266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412951.856014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412951.986578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412952.141413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412952.265939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412952.396112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412952.512055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412952.635637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412952.762073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412952.889257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412953.014556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412953.142190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412953.271264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412953.396840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412953.523240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412953.650202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412953.774482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412953.920226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412954.028538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412954.166087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412954.293695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412954.428543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412954.563852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412954.689586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412954.815037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412954.952887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412955.065960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412955.195500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412955.326475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412955.442107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412955.583378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412955.715513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412955.840527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412955.979616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412956.095059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412956.232023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412956.362429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412956.502050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412956.642463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412956.769651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412956.893250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412957.017661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412957.133478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412957.256258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412957.389232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412957.514794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412957.639311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412957.766006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412957.899502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412958.027283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412958.171873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412958.282739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412958.404651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412958.529432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412958.655942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412958.782433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412958.905638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412959.040575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412959.175348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412959.306675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412959.443041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412959.560371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412959.696738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412959.832149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412959.962788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412960.086503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412960.217270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412960.358814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412960.465864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412960.617365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412960.728236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412960.870417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412961.006715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412961.121064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412961.258677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412961.386864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412961.515612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412961.661545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412961.770410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412961.915239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412962.052357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412962.177190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412962.322833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412962.483880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412962.605168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412962.751570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412962.876246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412963.005186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412963.210088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412963.349109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412963.487399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412963.610208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412963.755713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412963.897064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412964.029676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412964.154101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412964.288785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412964.420044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412964.554163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412964.689994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412964.826380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412964.962368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412965.089066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412965.215460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412965.336013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412965.475382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412965.597031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412965.725790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412965.857415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412965.996370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412966.150282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412966.264683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412966.403758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412966.517136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412966.646803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412966.785007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412966.902293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412967.022156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412967.153063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412967.277348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412967.408718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412967.540644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412967.664240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412967.792618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412967.938497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412968.077759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412968.226777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412968.342859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412968.488424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412968.595309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412968.730644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412968.859329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412969.001143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412969.124593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412969.259881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412969.408199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412969.519237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412969.639897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412969.768300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412969.893798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412970.025125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412970.139481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412970.274605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412970.403154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412970.536799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412970.658250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412970.796381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412970.934536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412971.064218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412971.186664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412971.318854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412971.449029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412971.582457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412971.705936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412971.852916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412971.960188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412972.085822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412972.214002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412972.345773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412972.479000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412972.610050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412972.732294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412972.863598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412973.000878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412973.148090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412973.258552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412973.383944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412973.518495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412973.646545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412973.768738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412973.913918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412974.033105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412974.157263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412974.289238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412974.428158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412974.547689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412974.675026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412974.824592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412974.968840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412975.078191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412975.202319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412975.328967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412975.468845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412975.595263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412975.727864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412975.890049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412976.021704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412976.151141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412976.290074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412976.396728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412976.558624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412976.653318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412976.788338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412976.921601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412977.059361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412977.181941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412977.322100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412977.450184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412977.579407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412977.706798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412977.851770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412977.967306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412978.086255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412978.218209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412978.347674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412978.475739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412978.624943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412978.763604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412978.890311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412979.015007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412979.148782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412979.274784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412979.399836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412979.524464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412979.652398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412979.775579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412979.915650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412980.030749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412980.185167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412980.304276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412980.439402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412980.570781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412980.702572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412980.823806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412980.965604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412981.074240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412981.206878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412981.332685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412981.459930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412981.589522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412981.722689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412981.874792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412981.986613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412982.126707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412982.264867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412982.387150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412982.520563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412982.643369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412982.769056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412982.892823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412983.024765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412983.145139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412983.272703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412983.399354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412983.526877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412983.651986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412983.799017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412983.912981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412984.060863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412984.188354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412984.319403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412984.449600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412984.599302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412984.731899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412984.871570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412984.999080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412985.133492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412985.253359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412985.384812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412985.512010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412985.646524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412985.769886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412985.899780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412986.027349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412986.163040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412986.378694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412986.547230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412986.848794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412987.093562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412987.208000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412987.333145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412987.479645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412987.592167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412987.726415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412987.847070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412987.974316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412988.121121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412988.251861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412988.380829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412988.505133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412988.645512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412988.779162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412988.908028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412989.037141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412989.200486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412989.314459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412989.454932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412989.584835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412989.710822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412989.845043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412989.958537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412990.086077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412990.211223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412990.337343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412990.463203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412990.592518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412990.726898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412990.850711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412990.984155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412991.116859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412991.250929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412991.389904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412991.537869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412991.652201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412991.805627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412991.934842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412992.076205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412992.201938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412992.337546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412992.461093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412992.590729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412992.710225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412992.840068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412992.971395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412993.088194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412993.213783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412993.349368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412993.469129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412993.600952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412993.745609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412993.887213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412994.018541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412994.153200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412994.268436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412994.385161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412994.522304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412994.650234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412994.770166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412994.896713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412995.024917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412995.140840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412995.256442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412995.387625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412995.512018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412995.662899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412995.773597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412995.902012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412996.026113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412996.153317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412996.277471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412996.406704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412996.529291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412996.656206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412996.777268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412996.911623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412997.031092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412997.166627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412997.301702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412997.434959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412997.565589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412997.690127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412997.824209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412997.946944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412998.076517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412998.201554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412998.329946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412998.457874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412998.573833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638412998.711380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412998.844986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412998.956304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412999.095695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412999.205332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412999.333615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412999.453459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412999.579163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412999.701966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412999.837848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638412999.965776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413000.091923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413000.218746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413000.338405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413000.492606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413000.601434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413000.731730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413000.882034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413001.014424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413001.143063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413001.269019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413001.394150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413001.519671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413001.640780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413001.781941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413001.895937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413002.024287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413002.158724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413002.276111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413002.399161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413002.523801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413002.653877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413002.787728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413002.917925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413003.063435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413003.187347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413003.314734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413003.458850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413003.587936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413003.717615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413003.846009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413003.978302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413004.111196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413004.243132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413004.354943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413004.498539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413004.626202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413004.750897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413004.887880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413005.011932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413005.148629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413005.287133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413005.417363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413005.539621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413005.666234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413005.795650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413005.939049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413006.074824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413006.203619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413006.330727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413006.459643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413006.584748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413006.726174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413006.836040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413006.957146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413007.090169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413007.227637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413007.349904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413007.505506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413007.614389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413007.760588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413007.877796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413008.014131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413008.135010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413008.266556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413008.390854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413008.514477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413008.642654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413008.776359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413008.893519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413009.037718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413009.147198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413009.290064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413009.416263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413009.548702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413009.690594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413009.820848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413009.943151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413010.070698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413010.202881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413010.333316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413010.452384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413010.588580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413010.709727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413010.837680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413010.979255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413011.090998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413011.217683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413011.355625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413011.477771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413011.606631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413011.753538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413011.897021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413012.019437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413012.144263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413012.279847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413012.398060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413012.521140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413012.650174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413012.779348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413012.902980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413013.042034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413013.169906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413013.305882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413013.451840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413013.570396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413013.704189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413013.839853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413013.964738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413014.084251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413014.221445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413014.350100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413014.460264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413014.588768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413014.723305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413014.853702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413014.977116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413015.120908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413015.257481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413015.378053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413015.527649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413015.641870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413015.775691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413015.899614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413016.026274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413016.152568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413016.280780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413016.417085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413016.541639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413016.668657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413016.811796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413016.942630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413017.073361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413017.200001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413017.330748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413017.454735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413017.587792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413017.723052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413017.844317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413017.964644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413018.099911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413018.226146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413018.362607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413018.496675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413018.624699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413018.768585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413018.894230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413019.013760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413019.140417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413019.264319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413019.394105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413019.525074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413019.645865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413019.790018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413019.911924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413020.040646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413020.183291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413020.331186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413020.438595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413020.574060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413020.703433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413020.828186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413020.955901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413021.085260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413021.209484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413021.333840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413021.464558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413021.590038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413021.719082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413021.914881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413022.055775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413022.201525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413022.324703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413022.447990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413022.584472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413022.703374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413022.835503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413022.952014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413023.084609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413023.206639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413023.337999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413023.621335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413023.974673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413024.295621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413024.546522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413024.788427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413024.954388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413025.181375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413025.367252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413025.566670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413025.780193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413025.912875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413026.090656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413026.293246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413026.421314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413026.621348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413026.780159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413026.957469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413027.124786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413027.300704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413027.470262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413027.642727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413027.795923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413027.977897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413028.184896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413028.374566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413028.556273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413028.708429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413028.890236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413029.058724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413029.240750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413029.500633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413029.664737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413029.812125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413029.958828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413030.087881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413030.272533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413030.436272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413030.588727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413030.772402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413030.937417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413031.089403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413031.260146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413031.453774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413031.649742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413031.811275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413031.972408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413032.140707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413032.289138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413032.511655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413032.665650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413032.835748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413033.154697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413033.331666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413033.475044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413033.606873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413033.741225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413033.876869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413034.034313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413034.140331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413034.266618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413034.398746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413034.527586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413034.645948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413034.774159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413034.911583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413035.029918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413035.170822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413035.304997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413035.443319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413035.569280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413035.693242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413035.833656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413036.001779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413036.223900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413036.351921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413036.490418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413036.607041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413036.732648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413036.875191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413037.000150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413037.140707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413037.255816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413037.401249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413037.521576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413037.648026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413037.769888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413037.890053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413038.019542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413038.140335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413038.265350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413038.396235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413038.524259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413038.649052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413038.780834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413038.902474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413039.030321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413039.149100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413039.288020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413039.419056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413039.546089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413039.671874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413039.798415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413039.931720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413040.089813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413040.223622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413040.335191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413040.466670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413040.582543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413040.707641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413040.839086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413040.964334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413041.096878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413041.224059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413041.376576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413041.507283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413041.625550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413041.766443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413041.897315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413042.018266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413042.152263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413042.277358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413042.409673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413042.538760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413042.666225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413042.794902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413042.920398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413043.054281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413043.187546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413043.314086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413043.454040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413043.575051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413043.717245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413043.830585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413043.960185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413044.081848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413044.208810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413044.339835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413044.465298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413044.594159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413044.724877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413044.846925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413044.980587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413045.113280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413045.255901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413045.382888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413045.514819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413045.635723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413045.774468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413045.892448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413046.023317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413046.140783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413046.270869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413046.391697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413046.522129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413046.646808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413046.787707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413046.900517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413047.030290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413047.166733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413047.281582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413047.418588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413047.555549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413047.680633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413047.822516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413047.946323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413048.081680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413048.201171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413048.334559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413048.460743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413048.586406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413048.704754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413048.832342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413048.952054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413049.082541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413049.217041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413049.342734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413049.461648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413049.589479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413049.713050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413049.839811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413049.963650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413050.097784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413050.226582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413050.355620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413050.475780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413050.616285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413050.745744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413050.882891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413051.010986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413051.143924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413051.263707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413051.396615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413051.520067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413051.646538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413051.779088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413051.912991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413052.048251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413052.187279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413052.319205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413052.458234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413052.582882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413052.703040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413052.831436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413052.958366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413053.072870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413053.204061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413053.326418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413053.460289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413053.577054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413053.706714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413053.830522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413053.985479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413054.116025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413054.230291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413054.367661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413054.501862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413054.636758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413054.769662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413054.897289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413055.016308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413055.140364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413055.271844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413055.390153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413055.520733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413055.637017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413055.774733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413055.894617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413056.027508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413056.151445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413056.282634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413056.416925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413056.544139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413056.677205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413056.806694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413056.938265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413057.064483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413057.185735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413057.313905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413057.449047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413057.583322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413057.708864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413057.850783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413057.953655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413058.097407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413058.203533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413058.335852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413058.460768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413058.593697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413058.726631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413058.841949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413058.971840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413059.100589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413059.219852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413059.356664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413059.482537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413059.631259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413059.761578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413059.890708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413060.008811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413060.144126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413060.263559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413060.388860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413060.516140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413060.646893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413060.766333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413060.900497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413061.026017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413061.150618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413061.275973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413061.435090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413061.550119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413061.687600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413061.823378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413061.955296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413062.074111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413062.211844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413062.337745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413062.460341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413062.587814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413062.723626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413062.849485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413062.980393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413063.113841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413063.250051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413063.386095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413063.519386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413063.640514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413063.773720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413063.899776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413064.019404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413064.160467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413064.276426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413064.404448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413064.536638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413064.655612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413064.789687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413064.916203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413065.059497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413065.196453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413065.325108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413065.446680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413065.573975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413065.694194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413065.827393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413065.956302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413066.089758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413066.207167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413066.355913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413066.468964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413066.601252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413066.726496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413066.864115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413066.980338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413067.120164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413067.246590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413067.388450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413067.517896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413067.637505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413067.774900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413067.884132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413068.014673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413068.140429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413068.268336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413068.395097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413068.515798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413068.646554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413068.764836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413068.900416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413069.019553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413069.144811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413069.268757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413069.398717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413069.543443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413069.666463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413069.788345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413069.903133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413070.031279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413070.162214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413070.294298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413070.429649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413070.565206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413070.696283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413070.822456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413070.950095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413071.075403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413071.202267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413071.330071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413071.467722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413071.576372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413071.712571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413071.837047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413071.967258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413072.094333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413072.217726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413072.353837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413072.474622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413072.608309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413072.744769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413072.872042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413073.010876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413073.137774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413073.272206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413073.393287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413073.519640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413073.642349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413073.772363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413073.900047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413074.026656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413074.154481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413074.275669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413074.405941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413074.530256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413074.659679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413074.807585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413074.953108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413075.066099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413075.195157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413075.322685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413075.445891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413075.579380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413075.706458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413075.822663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413075.951849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413076.079597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413076.204642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413076.334576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413076.454484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413076.599923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413076.711919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413076.853827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413076.972540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413077.083932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413077.212953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413077.339327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413077.461024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413077.593752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413077.718462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413077.850550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413077.972698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413078.129006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413078.233428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413078.375912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413078.499218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413078.635303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413078.767963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413078.897478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413079.022676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413079.159909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413079.284418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413079.413590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413079.539428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413079.685179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413079.823161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413079.957296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413080.076498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413080.207615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413080.328725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413080.460931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413080.602407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413080.710854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413080.828377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413080.958170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413081.091335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413081.228260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413081.358458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413081.496708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413081.622943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413081.756052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413081.914693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413082.064376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413082.181462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413082.310156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413082.442266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413082.572659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413082.696779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413082.827293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413082.970512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413083.082200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413083.206659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413083.327897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413083.457074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413083.583369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413083.703072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413083.846137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413083.970384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413084.096785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413084.215925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413084.369552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413084.480249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413084.606137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413084.747517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413084.873186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413085.013356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413085.134981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413085.265270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413085.394058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413085.511849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413085.659654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413085.758933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413085.901159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413086.006765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413086.147933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413086.266562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413086.384891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413086.516711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413086.644326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413086.772792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413086.903538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413087.017908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413087.134193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413087.286808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413087.429947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413087.562134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413087.700789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413087.832933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413087.967825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413088.086958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413088.217248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413088.351575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413088.474714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413088.615309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413088.749288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413088.871452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413088.998091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413089.128422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413089.272553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413089.398991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413089.522834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413089.643077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413089.766720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413089.899743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413090.034466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413090.161532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413090.294281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413090.429327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413090.562741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413090.685740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413090.819667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413090.950216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413091.082792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413091.199213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413091.334278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413091.454682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413091.580043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413091.705175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413091.854860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413091.979328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413092.103183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413092.233138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413092.353771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413092.498517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413092.621550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413092.763267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413092.887609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413093.013418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413093.141414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413093.275499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413093.395556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413093.513658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413093.640714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413093.766302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413093.912781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413094.029227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413094.158366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413094.287744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413094.424086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413094.567429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413094.699911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413094.830490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413094.948623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413095.085630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413095.210537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413095.331881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413095.461145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413095.582788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413095.705970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413095.855442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413095.979330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413096.102746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413096.238453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413096.364660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413096.493601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413096.615145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413096.756858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413096.877036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413097.019686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413097.125000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413097.266508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413097.381539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413097.517498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413097.644036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413097.766849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413097.891546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413098.028183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413098.144355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413098.274681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413098.396790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413098.519326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413098.661134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413098.769517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413098.890331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413099.017645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413099.143868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413099.269106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413099.390260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413099.519052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413099.638160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413099.760556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413099.888780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413100.020929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413100.144328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413100.273604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413100.402201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413100.540901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413100.664673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413100.786482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413100.928822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413101.062181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413101.189011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413101.319954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413101.449353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413101.580912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413101.696436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413101.842504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413101.973113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413102.101261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413102.239549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413102.359141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413102.503164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413102.637099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413102.761803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413102.897940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413103.014858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413103.163069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413103.261703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413103.386199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413103.512568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413103.637355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413103.769958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413103.900259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413104.025790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413104.153139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413104.274070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413104.401115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413104.525614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413104.660619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413104.791749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413104.916221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413105.059519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413105.188559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413105.317064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413105.450535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413105.564290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413105.708051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413105.829875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413105.956837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413106.080690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413106.211382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413106.353671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413106.484212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413106.600551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413106.726683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413106.866782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413106.997677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413107.118115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413107.253641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413107.378856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413107.504039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413107.624840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413107.760427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413107.880666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413108.018093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413108.142474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413108.268991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413108.393281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413108.520642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413108.646513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413108.779540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413108.918470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413109.032490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413109.160023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413109.287351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413109.425862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413109.560815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413109.692428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413109.833633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413109.946477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413110.077807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413110.208473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413110.335813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413110.454701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413110.586332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413110.711617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413110.836472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413110.965443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413111.096618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413111.242098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413111.371926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413111.497755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413111.633315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413111.756453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413111.907902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413112.030564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413112.175125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413112.282638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413112.432317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413112.543468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413112.683280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413112.818004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413112.941253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413113.082996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413113.199389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413113.324811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413113.453133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413113.571196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413113.713946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413113.831537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413113.967074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413114.095173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413114.230310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413114.353419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413114.523147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413114.623566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413114.766988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413114.886991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413115.020624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413115.148481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413115.277469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413115.400361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413115.529952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413115.666137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413115.785427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413115.929996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413116.054907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413116.194999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413116.326069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413116.446210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413116.586000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413116.763123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413116.913293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413117.038893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413117.196353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413117.314112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413117.450402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413117.572809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413117.724003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413117.832357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413117.980511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413118.097272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413118.220904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413118.364330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413118.481225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413118.618008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413118.766102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413118.892102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413119.022428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413119.142209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413119.271505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413119.393656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413119.521615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413119.642839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413119.772084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413119.914896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413120.040795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413120.164053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413120.301242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413120.420825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413120.565254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413120.688630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413120.828368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413120.946156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413121.080502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413121.203166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413121.327202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413121.453838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413121.581866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413121.703891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413121.835311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413121.958725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413122.099059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413122.224563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413122.375716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413122.498735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413122.636410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413122.760846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413122.896879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413123.012987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413123.143263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413123.282716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413123.396069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413123.520304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413123.646385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413123.769435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413123.901851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413124.033811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413124.158616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413124.287078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413124.407362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413124.534548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413124.673693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413124.808690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413124.954115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413125.071985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413125.205845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413125.346557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413125.452454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413125.571879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413125.703486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413125.842185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413125.957792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413126.085255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413126.217821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413126.341004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413126.475336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413126.596481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413126.745978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413126.870933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413126.992568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413127.128546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413127.271309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413127.392599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413127.525265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413127.660257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413127.798322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413127.920127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413128.041986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413128.183955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413128.319996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413128.448643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413128.571415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413128.711494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413128.838924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413128.960531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413129.089582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413129.226319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413129.368228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413129.481117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413129.620143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413129.762126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413129.893173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413130.014153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413130.138009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413130.258039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413130.390679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413130.507810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413130.640656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413130.767941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413130.896168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413131.019925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413131.157523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413131.281692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413131.409567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413131.532212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413131.669980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413131.806918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413131.948964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413132.072096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413132.199054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413132.331847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413132.455087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413132.579157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413132.704313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413132.829007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413132.957510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413133.074897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413133.210633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413133.331856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413133.458212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413133.586370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413133.711029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413133.840331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413133.964266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413134.085124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413134.216969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413134.349283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413134.475379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413134.601128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413134.748955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413134.869303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413135.016089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413135.138062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413135.269438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413135.397562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413135.538055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413135.649635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413135.775896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413135.909276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413136.035555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413136.161712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413136.291965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413136.430008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413136.576482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413136.695510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413136.827534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413136.951016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413137.082026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413137.196185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413137.333208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413137.459884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413137.585318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413137.712807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413137.843818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413137.970778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413138.106515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413138.233006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413138.372676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413138.509916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413138.636997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413138.762652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413138.896296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413139.013656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413139.145310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413139.277887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413139.409783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413139.544019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413139.663598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413139.796521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413139.947045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413140.074188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413140.201925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413140.327459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413140.453871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413140.578949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413140.707405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413140.839029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413140.973159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413141.082095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413141.207046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413141.336250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413141.475176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413141.606751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413141.744122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413141.901206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413142.032733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413142.165092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413142.300840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413142.430498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413142.570353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413142.691396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413142.825856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413142.939713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413143.073025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413143.197252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413143.329174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413143.458709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413143.586425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413143.712187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413143.852337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413143.962780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413144.098410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413144.229877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413144.393755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413144.627141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413144.959722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413145.298616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413145.596932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413145.931159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413146.122274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413146.286427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413146.485486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413146.658689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413146.829453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413146.997333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413147.148059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413147.334695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413147.493646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413147.660308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413147.836888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413148.051626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413148.178926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413148.353947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413148.525290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413148.722471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413148.874322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413149.019430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413149.202844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413149.375978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413149.640811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413149.908666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413150.151111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413150.398227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413150.600826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413150.962736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413151.094100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413151.492284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413151.725589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413151.944921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413152.199087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413152.400701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413152.594693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413152.843060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413153.099199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413153.290154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413153.427987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413153.665332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413153.852216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413154.179114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413154.368275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413154.633591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413154.846298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413155.020732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413155.206135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413155.395509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413155.576823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413155.732384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413155.894937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413156.014675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413156.149659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413156.272792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413156.428299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413156.548645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413156.682253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413156.806789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413156.948746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413157.072421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413157.204405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413157.322311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413157.459853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413157.694121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413157.835496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413157.963035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413158.087920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413158.214522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413158.343245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413158.469522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413158.589086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413158.734598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413158.873901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413159.013298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413159.122463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413159.245916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413159.384581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413159.512626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413159.648000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413159.766519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413159.894218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413160.021237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413160.156471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413160.270808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413160.393244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413160.523939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413160.652709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413160.782552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413160.913918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413161.061366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413161.227777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413161.362110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413161.494530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413161.620634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413161.761255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413161.891729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413162.052528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413162.175834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413162.303963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413162.453501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413162.576720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413162.711653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413162.848709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413162.979837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413163.111206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413163.246432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413163.369354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413163.502254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413163.634963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413163.753140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413163.880303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413164.016571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413164.144327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413164.271194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413164.396243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413164.523523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413164.653624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413164.790754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413164.913474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413165.053620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413165.191989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413165.328240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413165.463238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413165.594924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413165.713835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413165.848777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413165.982475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413166.103306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413166.238311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413166.389116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413166.511710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413166.642985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413166.771958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413166.892090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413167.027185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413167.158011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413167.277331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413167.410225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413167.536512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413167.669589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413167.816578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413167.946045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413168.070571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413168.200998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413168.322507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413168.455980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413168.578240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413168.720569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413168.842535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413168.962280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413169.085084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413169.219941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413169.334882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413169.468769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413169.595736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413169.720448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413169.850426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413169.991454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413170.124266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413170.252955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413170.375630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413170.518283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413170.634503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413170.768221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413170.907220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413171.022061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413171.149763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413171.278791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413171.406480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413171.554485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413171.660872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413171.802450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413171.953476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413172.079806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413172.206605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413172.331216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413172.455413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413172.583888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413172.706696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413172.837181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413172.959221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413173.086986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413173.223248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413173.359706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413173.503808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413173.631218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413173.764164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413173.893545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413174.030303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413174.136702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413174.260249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413174.391565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413174.513084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413174.646765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413174.773742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413174.910693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413175.027020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413175.173623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413175.310103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413175.433826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413175.571368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413175.708513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413175.829860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413175.957412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413176.082094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413176.212968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413176.333341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413176.468750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413176.595926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413176.724433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413176.954903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413177.090744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413177.216061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413177.345560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413177.493554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413177.622654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413177.753950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413177.880649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413178.012574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413178.129977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413178.263438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413178.388340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413178.517017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413178.647698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413178.770703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413178.905625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413179.026582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413179.147140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413179.279922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413179.394158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413179.520240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413179.658537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413179.808918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413179.948637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413180.076833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413180.205001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413180.331346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413180.456863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413180.586596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413180.710189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413180.861360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413180.965522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413181.095915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413181.236179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413181.380144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413181.515450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413181.644546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413181.762172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413181.896120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413182.016891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413182.150148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413182.274453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413182.408745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413182.540143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413182.685804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413182.811050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413182.938727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413183.069111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413183.202989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413183.344239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413183.455469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413183.581455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413183.707683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413183.842007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413183.976048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413184.082302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413184.208126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413184.351754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413184.459661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413184.601832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413184.717104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413184.859796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413184.984633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413185.117524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413185.250243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413185.387435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413185.520500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413185.650207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413185.768149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413185.899540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413186.029342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413186.164724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413186.295747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413186.433218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413186.571115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413186.693332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413186.825148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413186.950401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413187.081110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413187.203090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413187.333510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413187.455204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413187.583868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413187.709590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413187.838639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413187.971127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413188.116739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413188.231169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413188.372973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413188.502000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413188.631236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413188.753932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413188.880150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413189.010235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413189.137963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413189.259039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413189.404642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413189.518442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413189.647571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413189.778359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413189.907521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413190.050950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413190.188749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413190.306147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413190.435592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413190.569956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413190.701418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413190.824950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413190.962862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413191.073831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413191.203772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413191.343641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413191.454411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413191.590619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413191.723344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413191.846436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413191.980922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413192.128088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413192.246337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413192.373346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413192.502645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413192.629729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413192.750206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413192.870192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413193.004123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413193.147335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413193.270787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413193.391577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413193.525049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413193.656724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413193.784685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413193.940833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413194.052945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413194.193836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413194.317774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413194.448757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413194.579544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413194.700143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413194.845037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413194.950879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413195.079538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413195.211939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413195.346285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413195.465513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413195.594077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413195.729217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413195.867669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413196.008508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413196.146529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413196.262450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413196.397224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413196.520296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413196.644987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413196.773312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413196.907290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413197.030036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413197.165727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413197.299186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413197.430410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413197.560729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413197.709198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413197.839849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413197.962900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413198.098387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413198.230495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413198.362497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413198.500872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413198.633109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413198.758056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413198.881078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413199.004728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413199.127046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413199.261303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413199.387023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413199.523550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413199.648161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413199.783499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413199.932804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413200.069163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413200.200578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413200.341755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413200.450168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413200.578632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413200.703901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413200.843635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413200.968053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413201.094445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413201.237982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413201.355654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413201.489743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413201.619848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413201.750430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413201.903015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413202.037555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413202.178698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413202.308632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413202.434640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413202.560106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413202.686133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413202.820491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413202.944009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413203.079146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413203.200042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413203.337112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413203.452901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413203.577018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413203.724025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413203.847060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413204.015737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413204.121001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413204.256940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413204.388403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413204.513200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413204.638823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413204.783472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413204.891509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413205.036437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413205.169903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413205.285035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413205.414032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413205.554822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413205.662838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413205.809822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413205.938515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413206.070694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413206.204417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413206.328207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413206.455135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413206.580858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413206.696790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413206.831111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413206.955358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413207.080179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413207.212798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413207.363662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413207.488670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413207.603876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413207.744837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413207.878107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413207.998010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413208.141088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413208.256874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413208.385518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413208.510785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413208.644124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413208.759029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413208.893970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413209.019126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413209.173867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413209.276751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413209.408233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413209.535400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413209.663818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413209.810816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413209.940220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413210.062428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413210.196923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413210.318438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413210.446221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413210.571358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413210.699701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413210.821847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413210.947713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413211.080200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413211.200068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413211.328073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413211.449951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413211.574626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413211.707390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413211.833753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413211.970135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413212.097031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413212.269839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413212.393704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413212.530560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413212.642606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413212.789841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413212.916953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413213.034398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413213.159838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413213.301192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413213.441803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413213.558145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413213.688980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413213.816987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413213.943388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413214.076450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413214.195046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413214.367741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413214.470694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413214.609717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413214.740263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413214.875027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413215.010923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413215.127933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413215.256045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413215.387897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413215.512879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413215.644105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413215.761198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413215.929253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413216.049535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413216.181417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413216.321202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413216.446478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413216.574913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413216.700639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413216.830187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413216.960462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413217.082303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413217.208225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413217.334534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413217.471104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413217.596475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413217.741838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413217.896282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413218.033237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413218.155416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413218.283009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413218.417831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413218.543390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413218.682318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413218.825836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413218.949856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413219.083577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413219.207977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413219.338460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413219.468077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413219.596699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413219.718518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413219.856970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413219.984253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413220.125944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413220.273625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413220.385465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413220.510131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413220.655848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413220.755932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413220.890700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413221.022821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413221.148860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413221.287033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413221.409073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413221.536848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413221.659621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413221.798904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413221.928799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413222.053680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413222.204167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413222.313477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413222.435155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413222.570272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413222.706674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413222.830561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413222.954828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413223.075548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413223.207646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413223.330076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413223.462751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413223.583061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413223.726026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413223.851117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413223.991210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413224.130813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413224.260217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413224.389815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413224.520320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413224.639898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413224.768228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413224.885315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413225.018894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413225.142674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413225.268543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413225.388594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413225.520839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413225.640450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413225.765957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413225.891587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413226.018785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413226.158343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413226.283339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413226.391816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413226.534088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413226.645261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413226.773166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413226.910266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413227.052793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413227.178710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413227.316471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413227.440885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413227.573124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413227.698419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413227.827331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413227.955141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413228.081442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413228.206163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413228.335167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413228.457936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413228.594643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413228.726786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413228.862662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413228.970821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413229.102899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413229.235017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413229.378030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413229.515783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413229.644059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413229.771544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413229.898474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413230.023922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413230.155647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413230.294259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413230.432893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413230.563767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413230.695174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413230.836847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413230.952779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413231.078106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413231.205799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413231.328946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413231.455872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413231.581252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413231.709521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413231.844532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413231.992404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413232.110908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413232.248148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413232.368011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413232.504988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413232.626920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413232.758086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413232.890909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413233.020864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413233.138752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413233.266782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413233.388481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413233.521351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413233.649245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413233.774905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413233.904015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413234.035194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413234.164129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413234.319288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413234.450242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413234.571393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413234.689511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413234.822879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413234.947725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413235.077647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413235.203482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413235.344742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413235.455505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413235.585176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413235.708227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413235.851388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413235.978835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413236.130986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413236.250471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413236.384005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413236.510657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413236.634950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413236.760747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413236.890375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413237.017032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413237.145238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413237.269373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413237.408835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413237.536187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413237.678567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413237.806376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413237.931374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413238.061226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413238.194204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413238.315315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413238.447873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413238.569692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413238.702696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413238.820602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413238.950658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413239.075716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413239.216860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413239.333289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413239.459781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413239.586326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413239.725417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413239.844556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413239.992425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413240.118907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413240.257418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413240.376897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413240.510097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413240.635473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413240.760576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413240.888494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413241.013348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413241.137662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413241.268874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413241.395745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413241.521867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413241.646496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413241.771397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413241.895025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413242.029016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413242.166788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413242.287341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413242.434062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413242.554632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413242.683133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413242.808918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413242.933248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413243.059141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413243.194592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413243.326326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413243.451368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413243.594150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413243.696546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413243.831789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413243.952385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413244.080601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413244.202834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413244.346519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413244.457696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413244.581109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413244.739324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413244.850441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413244.983397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413245.114765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413245.250284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413245.368819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413245.497074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413245.624039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413245.751019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413245.892122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413246.015991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413246.157596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413246.259287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413246.394342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413246.512565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413246.643420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413246.769166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413246.913905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413247.035828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413247.158040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413247.290033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413247.433254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413247.544152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413247.670048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413247.806055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413247.938022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413248.062411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413248.195765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413248.325373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413248.458162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413248.579956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413248.716685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413248.848551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413248.977326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413249.117603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413249.243444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413249.370666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413249.508161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413249.631769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413249.778193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413249.887320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413250.019723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413250.137745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413250.265561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413250.394058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413250.530457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413250.654071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413250.781122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413250.909345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413251.042057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413251.177863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413251.315904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413251.444149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413251.577033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413251.701654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413251.829767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413251.972091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413252.080324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413252.208328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413252.353959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413252.469711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413252.598140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413252.727199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413252.859062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413252.990710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413253.144526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413253.253554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413253.389802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413253.506979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413253.636357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413253.768901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413253.897112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413254.014519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413254.136773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413254.265479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413254.392911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413254.514035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413254.653075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413254.770646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413254.914852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413255.025254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413255.152483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413255.287661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413255.416533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413255.536867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413255.685780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413255.814057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413255.941956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413256.060283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413256.193116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413256.316989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413256.453287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413256.564012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413256.701497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413256.817339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413256.953103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413257.076805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413257.205759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413257.331237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413257.454352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413257.582915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413257.712596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413257.855785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413257.986903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413258.120939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413258.254352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413258.371848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413258.512425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413258.630556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413258.758179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413258.877229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413259.005901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413259.137925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413259.260853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413259.390344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413259.518283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413259.641631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413259.769978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413259.906050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413260.033977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413260.157779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413260.305418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413260.434044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413260.554872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413260.682729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413260.820700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413260.949263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413261.082857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413261.194616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413261.332465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413261.451813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413261.579074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413261.696928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413261.836358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413261.978011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413262.117268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413262.247899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413262.404500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413262.508968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413262.635562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413262.764535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413262.892769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413263.008112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413263.146358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413263.260619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413263.406317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413263.512542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413263.638291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413263.767982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413263.912156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413264.046049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413264.161733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413264.294733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413264.428251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413264.555871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413264.694345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413264.818021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413264.953401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413265.075145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413265.213533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413265.461511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413265.773057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413266.143224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413266.447129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413266.791085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413266.994293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413267.191858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413267.392617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413267.559772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413267.740661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413267.910258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413268.081805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413268.226669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413268.407277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413268.627818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413268.772889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413268.959697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413269.102480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413269.264407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413269.407622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413269.577318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413269.742597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413269.926168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413270.099607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413270.266864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413270.457956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413270.663463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413270.802171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413270.949295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413271.114634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413271.281761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413271.454596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413271.712761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413271.968828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413272.452849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413272.672588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413272.861211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413273.101866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413273.284745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413273.461682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413273.621770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413273.822839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413274.034819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413274.162879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413274.347757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413274.503930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413274.684905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413274.867509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413275.021311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413275.215924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413275.415461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413275.699001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413275.882411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413276.015008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413276.138409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413276.266607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413276.391536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413276.521241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413276.655570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413276.773174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413276.900280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413277.048565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413277.209525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413277.326519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413277.451086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413277.577880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413277.693866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413277.828239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413277.952185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413278.073757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413278.192299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413278.324908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413278.517113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413278.704057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413278.826576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413278.958578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413279.082109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413279.216748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413279.344009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413279.490654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413279.610760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413279.760159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413279.879107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413280.007024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413280.137980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413280.265773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413280.380129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413280.517690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413280.633885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413280.765162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413280.882893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413281.010880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413281.130355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413281.277483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413281.387590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413281.518711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413281.633149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413281.761504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413281.890689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413282.034595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413282.155391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413282.280158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413282.406611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413282.551993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413282.673898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413282.835176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413282.955657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413283.085174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413283.205192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413283.341135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413283.462658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413283.588276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413283.740962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413283.904070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413284.034362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413284.166035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413284.301787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413284.464178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413284.568960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413284.701563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413284.820742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413284.947951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413285.076413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413285.204459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413285.328834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413285.456647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413285.580298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413285.709625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413285.844320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413285.967303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413286.101221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413286.282218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413286.520430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413286.812314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413286.975587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413287.147511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413287.247827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413287.371042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413287.498155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413287.630733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413287.754113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413287.889986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413288.010633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413288.137619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413288.261952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413288.392417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413288.514132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413288.637321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413288.761178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413288.909701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413289.022057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413289.154050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413289.280360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413289.396634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413289.531811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413289.675156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413289.801663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413289.919966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413290.055303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413290.197327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413290.314632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413290.456839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413290.572314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413290.695300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413290.823251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413290.955938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413291.076073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413291.237594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413291.342013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413291.472635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413291.609953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413291.741414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413291.920397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413292.075652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413292.199011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413292.358453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413292.469560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413292.602947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413292.744758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413292.882171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413293.006750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413293.140257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413293.248863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413293.386897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413293.509511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413293.643523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413293.763201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413293.895047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413294.018191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413294.147535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413294.281994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413294.407007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413294.531506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413294.675616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413294.815232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413294.943616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413295.067134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413295.216686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413295.323285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413295.454119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413295.577834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413295.708990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413295.830909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413295.964326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413296.086943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413296.222299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413296.366850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413296.492134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413296.626856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413296.758600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413296.884296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413297.016463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413297.143355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413297.287846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413297.394812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413297.523458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413297.646958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413297.779648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413297.928874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413298.055047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413298.191112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413298.322025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413298.447962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413298.568415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413298.687694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413298.829015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413298.952786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413299.100401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413299.208833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413299.343836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413299.477870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413299.601104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413299.738931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413299.882429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413300.008567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413300.140112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413300.258781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413300.388317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413300.511869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413300.637554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413300.758857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413300.905098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413301.020723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413301.168889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413301.285872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413301.406452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413301.549991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413301.672089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413301.811440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413301.937324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413302.068533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413302.198761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413302.321902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413302.469998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413302.580504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413302.709817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413302.840845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413302.972092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413303.113424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413303.253435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413303.380232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413303.526399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413303.634684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413303.761808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413303.888350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413304.016660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413304.137332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413304.279671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413304.387124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413304.513916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413304.642527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413304.763875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413304.888313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413305.019766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413305.147326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413305.300627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413305.429433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413305.548876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413305.673919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413305.818818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413305.944857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413306.094362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413306.201293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413306.325825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413306.452258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413306.580024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413306.710234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413306.841360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413306.969064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413307.096749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413307.243638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413307.386150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413307.507010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413307.625894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413307.740020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413307.882060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413308.000706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413308.133652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413308.264935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413308.390011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413308.514050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413308.659166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413308.768857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413308.903229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413309.032579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413309.171585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413309.301205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413309.432745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413309.555408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413309.688316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413309.810959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413309.943319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413310.077303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413310.198124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413310.322546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413310.452911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413310.573224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413310.695885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413310.821767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413310.950673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413311.074608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413311.205825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413311.330136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413311.458344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413311.595583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413311.716752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413311.852183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413311.994429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413312.114594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413312.257368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413312.389880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413312.516163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413312.637442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413312.767501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413312.895696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413313.013365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413313.143466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413313.283171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413313.408708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413313.538420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413313.661777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413313.805059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413313.931316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413314.066924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413314.186714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413314.316330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413314.441424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413314.569542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413314.685773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413314.813781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413314.938846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413315.064208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413315.193763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413315.325204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413315.442848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413315.570935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413315.706399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413315.830809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413315.947056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413316.075906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413316.217477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413316.323015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413316.445531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413316.576539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413316.701663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413316.832829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413316.960283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413317.086227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413317.216792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413317.366103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413317.493836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413317.621761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413317.748451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413317.881225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413318.019243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413318.137530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413318.257723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413318.388118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413318.513337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413318.641127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413318.759393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413318.894233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413319.019985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413319.151575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413319.278952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413319.414199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413319.565153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413319.708801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413319.824071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413319.957495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413320.074860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413320.205124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413320.326771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413320.456236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413320.578240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413320.719047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413320.844115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413320.971349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413321.118835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413321.257822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413321.371560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413321.512143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413321.633690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413321.774085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413321.906979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413322.036720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413322.186156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413322.321522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413322.447389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413322.574663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413322.701789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413322.825007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413322.952728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413323.075588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413323.194177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413323.322842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413323.466486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413323.572660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413323.696060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413323.831854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413323.959048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413324.083557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413324.212129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413324.341950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413324.467892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413324.608263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413324.743778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413324.867809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413325.006958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413325.136794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413325.263204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413325.389715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413325.513692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413325.655208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413325.819634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413325.948149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413326.077917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413326.205493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413326.329834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413326.515184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413326.664758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413326.802198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413326.923540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413327.054305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413327.195684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413327.340793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413327.448350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413327.575956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413327.705530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413327.843661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413327.980767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413328.124187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413328.243430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413328.375228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413328.510410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413328.640554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413328.763767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413328.893621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413329.016575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413329.142766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413329.271126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413329.408429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413329.543019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413329.683624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413329.813195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413329.941296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413330.069054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413330.213178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413330.315169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413330.448667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413330.565767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413330.697134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413330.816898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413330.964183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413331.073097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413331.201640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413331.322043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413331.453443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413331.572815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413331.708350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413331.826679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413331.956855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413332.090112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413332.217184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413332.349748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413332.490317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413332.619991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413332.763593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413332.887790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413333.010761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413333.152898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413333.262821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413333.389966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413333.516148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413333.642394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413333.795525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413333.903624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413334.049702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413334.172028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413334.302881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413334.435402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413334.565633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413334.702935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413334.829293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413334.955229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413335.101088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413335.214373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413335.349358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413335.473190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413335.631502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413335.742587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413335.903858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413336.014222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413336.129543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413336.269870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413336.395859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413336.520002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413336.662076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413336.784146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413336.928100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413337.051836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413337.190212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413337.312196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413337.446274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413337.565615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413337.691402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413337.824117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413337.951664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413338.072923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413338.199838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413338.340606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413338.457764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413338.580521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413338.715051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413338.845868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413338.967109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413339.108318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413339.250414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413339.394758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413339.528840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413339.633460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413339.769588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413339.890754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413340.026957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413340.144706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413340.270820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413340.402925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413340.527441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413340.647795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413340.792855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413340.912928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413341.064565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413341.179356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413341.322054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413341.440376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413341.569677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413341.692465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413341.823875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413341.965175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413342.078877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413342.201882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413342.329736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413342.453981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413342.588024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413342.720470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413342.844341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413342.956792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413343.093775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413343.239527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413343.364552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413343.492790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413343.626780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413343.747129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413343.877748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413344.004516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413344.151314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413344.254610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413344.382476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413344.515235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413344.653999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413344.775063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413344.903006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413345.033808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413345.171128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413345.306714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413345.446883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413345.559420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413345.704732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413345.817056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413345.950177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413346.067637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413346.195473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413346.325479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413346.463397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413346.587842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413346.718750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413346.841275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413346.972080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413347.106977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413347.243809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413347.371397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413347.507392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413347.630928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413347.758703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413347.894608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413348.012945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413348.137158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413348.273326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413348.388379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413348.516733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413348.646744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413348.765187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413348.902618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413349.015378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413349.130503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413349.255862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413349.402251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413349.514996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413349.645621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413349.779083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413349.905938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413350.036544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413350.161213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413350.301269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413350.444522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413350.575990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413350.703980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413350.832660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413350.955267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413351.080729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413351.204945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413351.349841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413351.471203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413351.605278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413351.727839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413351.888594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413352.010158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413352.144656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413352.266335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413352.404361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413352.526212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413352.667398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413352.804281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413352.938726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413353.062459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413353.187644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413353.335284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413353.450987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413353.569488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413353.706007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413353.827496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413353.967659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413354.082655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413354.210353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413354.343883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413354.488456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413354.619263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413354.766478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413354.886945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413355.027959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413355.138154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413355.265227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413355.386425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413355.512956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413355.651640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413355.797705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413355.909697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413356.053900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413356.175083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413356.314779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413356.443810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413356.572639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413356.694516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413356.818600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413356.941535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413357.072239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413357.198794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413357.323687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413357.449795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413357.598731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413357.717523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413357.840142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413357.965421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413358.105062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413358.239785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413358.375224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413358.509099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413358.628293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413358.757542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413358.882123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413359.002693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413359.137287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413359.260926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413359.388572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413359.516052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413359.667286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413359.777711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413359.911076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413360.049085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413360.191730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413360.325535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413360.461903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413360.570127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413360.703932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413360.831558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413360.944097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413361.066929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413361.203919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413361.321620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413361.451263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413361.573739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413361.701737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413361.829344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413361.955407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413362.085616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413362.220409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413362.347955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413362.488356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413362.611407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413362.744806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413362.882324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413363.008980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413363.135432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413363.263597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413363.391816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413363.527813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413363.643072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413363.779933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413363.920211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413364.049677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413364.181821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413364.298053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413364.437822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413364.590487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413364.700021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413364.842263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413364.955338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413365.079899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413365.208262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413365.333106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413365.486253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413365.628012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413365.737869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413365.892426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413366.008013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413366.138115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413366.274779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413366.393952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413366.517501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413366.644786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413366.784145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413366.908860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413367.045315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413367.179876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413367.298740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413367.438353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413367.566250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413367.715544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413367.809957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413367.935613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413368.062383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413368.199556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413368.317661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413368.440892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413368.563215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413368.703652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413368.827814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413368.972340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413369.083745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413369.224232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413369.362035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413369.497854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413369.631024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413369.757706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413369.889565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413370.012299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413370.138744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413370.272104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413370.400909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413370.525905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413370.657522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413370.801238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413370.927676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413371.054848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413371.189613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413371.328866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413371.450440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413371.581784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413371.696602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413371.828257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413371.953787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413372.090135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413372.221706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413372.354139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413372.490823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413372.633022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413372.759316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413372.877525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413373.007963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413373.130708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413373.260161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413373.393867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413373.531502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413373.642083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413373.768905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413373.919864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413374.047823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413374.189312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413374.318124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413374.466247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413374.574857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413374.702444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413374.839472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413374.956314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413375.088559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413375.212153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413375.334204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413375.461766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413375.589725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413375.717556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413375.844573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413375.971478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413376.100672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413376.251176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413376.379675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413376.510029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413376.625182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413376.758957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413376.904158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413377.024464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413377.149887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413377.299599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413377.423976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413377.552439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413377.674515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413377.820892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413377.939291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413378.074208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413378.197102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413378.324182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413378.454333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413378.582754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413378.734530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413378.848903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413378.992103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413379.139313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413379.255782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413379.386878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413379.515534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413379.640259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413379.776772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413379.904230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413380.050521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413380.172039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413380.291512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413380.430142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413380.556692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413380.693837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413380.819414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413380.944800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413381.070489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413381.198095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413381.318802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413381.451600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413381.565474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413381.695928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413381.831784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413381.989342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413382.115108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413382.260855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413382.368902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413382.509011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413382.634612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413382.762810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413382.888771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413383.016082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413383.139892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413383.275483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413383.395235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413383.532259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413383.655338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413383.803861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413383.942553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413384.066414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413384.198797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413384.342098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413384.442936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413384.573015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413384.740528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413384.865456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413384.998327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413385.122244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413385.250346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413385.413363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413385.671163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413386.073430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413386.622625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413386.791576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413387.016488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413387.192819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413387.427182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413387.592581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413387.802186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413387.967992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413388.097739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413388.316691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413388.452132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413388.635130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413388.787935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413389.012035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413389.151898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413389.314076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413389.490129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413389.681581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413389.847226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413390.044630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413390.201207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413390.386770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413390.603145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413390.766709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413390.924649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413391.139274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413391.277723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413391.444334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413391.586220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413391.897185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413392.080800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413392.621148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413392.812797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413393.072047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413393.264867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413393.450283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413393.615837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413393.803873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413393.956170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413394.134429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413394.290832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413394.460883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413394.637256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413394.839170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413395.010262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413395.149137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413395.325262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413395.554735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413395.851694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413395.990777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413396.112770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413396.250431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413396.374334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413396.504619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413396.642593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413396.771614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413396.891455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413397.013588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413397.138065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413397.263926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413397.392414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413397.517631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413397.649917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413397.775974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413397.925637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413398.042816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413398.174365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413398.306733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413398.438102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413398.596960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413398.816790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413398.935786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413399.067992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413399.182651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413399.310771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413399.435129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413399.570709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413399.687018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413399.821242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413399.945634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413400.085705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413400.206239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413400.324822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413400.473920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413400.589291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413400.724711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413400.894560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413400.988247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413401.119296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413401.253462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413401.393839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413401.506448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413401.636506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413401.759838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413401.892176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413402.011828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413402.133790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413402.257953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413402.390116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413402.513741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413402.671133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413402.778995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413402.919937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413403.027318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413403.159433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413403.293098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413403.428489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413403.558750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413403.692723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413403.825011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413403.959641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413404.093659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413404.245968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413404.360423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413404.493911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413404.632047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413404.763676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413404.886636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413405.017135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413405.140893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413405.272937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413405.411275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413405.528882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413405.671045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413405.801420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413405.941557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413406.090031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413406.198714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413406.335351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413406.452756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413406.583085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413406.706052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413406.837943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413406.957143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413407.088804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413407.213486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413407.353032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413407.484265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413407.610071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413407.742314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413407.884300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413408.001576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413408.127220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413408.260032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413408.384909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413408.510562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413408.644596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413408.766105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413408.894085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413409.013985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413409.143672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413409.263867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413409.395702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413409.513123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413409.643217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413409.764957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413409.901814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413410.025534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413410.166992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413410.293726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413410.414770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413410.548000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413410.705102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413410.809928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413410.935989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413411.062560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413411.191897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413411.317200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413411.446964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413411.571069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413411.700245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413411.835867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413411.974451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413412.106749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413412.255721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413412.375665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413412.506501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413412.624898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413412.761896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413412.879061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413413.010874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413413.130033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413413.261644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413413.387105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413413.516745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413413.640000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413413.776548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413413.911531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413414.049006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413414.180194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413414.314548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413414.440686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413414.569197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413414.694987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413414.835798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413414.955714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413415.091533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413415.218460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413415.358625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413415.486641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413415.623753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413415.743649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413415.876115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413416.005312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413416.124453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413416.267966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413416.379865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413416.505829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413416.633961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413416.749422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413416.877533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413417.002623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413417.134767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413417.263729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413417.398347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413417.524550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413417.654963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413417.784695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413417.903099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413418.043792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413418.182599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413418.320911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413418.441782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413418.557999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413418.696309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413418.837931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413418.965274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413419.088497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413419.242228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413419.361199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413419.501024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413419.617850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413419.738419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413419.878995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413420.012525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413420.134264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413420.260415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413420.382097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413420.512619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413420.627328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413420.758135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413420.901421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413421.016133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413421.157188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413421.268835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413421.396507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413421.527460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413421.654494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413421.798889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413421.921715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413422.046570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413422.185126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413422.313838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413422.437209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413422.572514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413422.703317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413422.821275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413422.939436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413423.072623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413423.210866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413423.325432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413423.449051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413423.574523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413423.701912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413423.836465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413423.972981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413424.111305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413424.231514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413424.362170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413424.494015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413424.622178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413424.752404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413424.882580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413425.004668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413425.132472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413425.261699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413425.387512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413425.510352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413425.633103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413425.762689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413425.886260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413426.015577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413426.144529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413426.278010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413426.408254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413426.542731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413426.690809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413426.809230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413426.939812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413427.066218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413427.199508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413427.327879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413427.455652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413427.579020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413427.711071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413427.838638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413427.977210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413428.101513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413428.251782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413428.367918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413428.500015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413428.627505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413428.754185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413428.876016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413429.002969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413429.126905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413429.264190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413429.403547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413429.515438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413429.640566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413429.780285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413429.908309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413430.046662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413430.172457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413430.307292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413430.427732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413430.553337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413430.681816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413430.818770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413430.937660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413431.082585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413431.192895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413431.329081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413431.442423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413431.571344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413431.701547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413431.835146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413431.955832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413432.093308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413432.234019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413432.360451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413432.487518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413432.625709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413432.755021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413432.887078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413433.027575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413433.148035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413433.290939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413433.428592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413433.549321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413433.694680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413433.815815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413433.944689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413434.062656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413434.200743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413434.321038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413434.449289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413434.574183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413434.711853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413434.817572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413434.948226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413435.078713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413435.202712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413435.333020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413435.456157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413435.580057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413435.710693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413435.845563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413435.983845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413436.102765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413436.242012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413436.364209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413436.505690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413436.616943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413436.750876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413436.882815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413437.024565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413437.130716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413437.260983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413437.382811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413437.515951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413437.635600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413437.759774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413437.888650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413438.024184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413438.149597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413438.291929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413438.434431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413438.569490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413438.695251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413438.829606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413438.942063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413439.064916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413439.184263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413439.314611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413439.442917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413439.577596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413439.711152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413439.878515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413439.998189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413440.129869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413440.253346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413440.387116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413440.507822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413440.638565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413440.777650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413440.894241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413441.026130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413441.170161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413441.286291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413441.428277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413441.561489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413441.693021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413441.826212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413441.973408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413442.115413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413442.227376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413442.360769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413442.509765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413442.619434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413442.749748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413442.883587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413443.008240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413443.132064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413443.261242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413443.398326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413443.520293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413443.642588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413443.754555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413443.891108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413444.028031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413444.154263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413444.289909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413444.414484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413444.550533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413444.686065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413444.818540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413444.937219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413445.069913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413445.189978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413445.319999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413445.441262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413445.570163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413445.691876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413445.821141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413445.940452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413446.080773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413446.204820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413446.342198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413446.488956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413446.687944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413446.811639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413446.945164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413447.070050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413447.214568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413447.341180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413447.490685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413447.617629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413447.755338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413447.880244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413448.015150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413448.137791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413448.272943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413448.400486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413448.538870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413448.676652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413448.811721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413448.936904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413449.069894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413449.189469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413449.324913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413449.447628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413449.568869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413449.701692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413449.843925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413449.962743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413450.081002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413450.209907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413450.337233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413450.462957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413450.624263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413450.741270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413450.885484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413450.996518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413451.136876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413451.258755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413451.392002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413451.513739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413451.640314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413451.767705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413451.904685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413452.019931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413452.149528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413452.278519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413452.420768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413452.555734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413452.697111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413452.828532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413452.947667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413453.071689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413453.201028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413453.334721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413453.452570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413453.578777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413453.730401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413453.836961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413453.979586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413454.113549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413454.250426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413454.373559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413454.501569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413454.627169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413454.763958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413454.900900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413455.029024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413455.144497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413455.294716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413455.409964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413455.557573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413455.689332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413455.851952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413455.963943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413456.086425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413456.226365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413456.360637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413456.484676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413456.624485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413456.747604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413456.878614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413457.002963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413457.150949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413457.261135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413457.388379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413457.507522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413457.651632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413457.758590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413457.890430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413458.007747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413458.136522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413458.265079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413458.407464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413458.521783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413458.672594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413458.782284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413458.922889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413459.054996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413459.209411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413459.325827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413459.448299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413459.586515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413459.709222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413459.830379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413459.974727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413460.120273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413460.255823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413460.387235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413460.510334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413460.632639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413460.762310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413460.888680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413461.026759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413461.156959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413461.290447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413461.433883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413461.571996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413461.689909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413461.838882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413461.946798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413462.069167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413462.198170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413462.325496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413462.453690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413462.586427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413462.718341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413462.848460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413462.990419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413463.119232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413463.245848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413463.380392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413463.514895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413463.630822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413463.755285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413463.899624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413464.020452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413464.142221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413464.263502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413464.390170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413464.527295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413464.657283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413464.800957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413464.921271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413465.053312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413465.187923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413465.321056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413465.442826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413465.574124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413465.701855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413465.822230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413465.945520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413466.072476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413466.210567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413466.335307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413466.460197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413466.590578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413466.719993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413466.859600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413466.989362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413467.119995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413467.257698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413467.375155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413467.509716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413467.617880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413467.740182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413467.877899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413468.024118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413468.136829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413468.267911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413468.404963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413468.543781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413468.671472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413468.818592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413468.955309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413469.071847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413469.198092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413469.319616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413469.458473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413469.573493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413469.711879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413469.858612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413469.989866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413470.118713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413470.240792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413470.375380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413470.495081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413470.632171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413470.757694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413470.881244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413471.007191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413471.139120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413471.261063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413471.423562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413471.526469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413471.666996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413471.798419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413471.938962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413472.066738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413472.199520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413472.336066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413472.468812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413472.591366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413472.740578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413472.856271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413473.001040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413473.124067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413473.247267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413473.375148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413473.510075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413473.646963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413473.764774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413473.888527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413474.037784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413474.156458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413474.280630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413474.421017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413474.560406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413474.682904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413474.817724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413474.949127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413475.076268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413475.214092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413475.336056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413475.460231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413475.608004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413475.741524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413475.875460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413476.042574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413476.186358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413476.310512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413476.436852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413476.576105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413476.702157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413476.815950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413476.953726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413477.070066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413477.201514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413477.324097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413477.455847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413477.596076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413477.719151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413477.845640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413477.982319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413478.121477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413478.255633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413478.370063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413478.504141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413478.629792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413478.767058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413478.877621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413479.031272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413479.141144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413479.265416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413479.398823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413479.525165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413479.660056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413479.820244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413479.945348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413480.070519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413480.204294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413480.319962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413480.447138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413480.581618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413480.702584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413480.843739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413480.965999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413481.108566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413481.233685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413481.366597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413481.487872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413481.618735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413481.751074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413481.881898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413482.001349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413482.136515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413482.274389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413482.395815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413482.521529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413482.664447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413482.792528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413482.912870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413483.045337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413483.174320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413483.302009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413483.437443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413483.566130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413483.690173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413483.810377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413483.947557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413484.086065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413484.211512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413484.327887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413484.458229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413484.576462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413484.713252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413484.839263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413484.969742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413485.096743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413485.234852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413485.362610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413485.513070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413485.628587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413485.749366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413485.885763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413486.031733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413486.148569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413486.284247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413486.397210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413486.521534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413486.656558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413486.807787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413486.915869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413487.070950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413487.191081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413487.334844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413487.439633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413487.570179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413487.689596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413487.818352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413487.936056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413488.087985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413488.203092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413488.349774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413488.450073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413488.581674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413488.726511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413488.873495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413488.994989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413489.130844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413489.256806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413489.398532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413489.502787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413489.636991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413489.760148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413489.889616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413490.019004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413490.146419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413490.288019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413490.417802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413490.559636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413490.695794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413490.830952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413490.946757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413491.070967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413491.200459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413491.323023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413491.459738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413491.579845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413491.716282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413491.845944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413491.991446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413492.127345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413492.270078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413492.370517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413492.496425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413492.622558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413492.750215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413492.883704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413493.002939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413493.130018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413493.259889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413493.379874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413493.511038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413493.646855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413493.757941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413493.872964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413494.006613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413494.134576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413494.261414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413494.400219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413494.516193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413494.642001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413494.774509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413494.911641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413495.026678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413495.164026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413495.300974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413495.431034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413495.566978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413495.694082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413495.817908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413495.954442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413496.071819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413496.200598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413496.327866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413496.448745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413496.580097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413496.707417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413496.842288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413496.969461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413497.106795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413497.243552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413497.364182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413497.499208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413497.642985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413497.756917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413497.892685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413498.007698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413498.143698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413498.257612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413498.415640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413498.514736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413498.638222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413498.764783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413498.896295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413499.020402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413499.153794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413499.292543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413499.435988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413499.552701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413499.676624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413499.812068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413499.979518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413500.080279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413500.202027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413500.335031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413500.467908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413500.606077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413500.734952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413500.864091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413501.015129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413501.146451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413501.256730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413501.390670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413501.510193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413501.632964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413501.767585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413501.912132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413502.060702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413502.191408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413502.325443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413502.444187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413502.576519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413502.698071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413502.828361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413502.952866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413503.099256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413503.214294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413503.353114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413503.477448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413503.633502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413503.752374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413503.890220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413504.009530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413504.142445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413504.264763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413504.388335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413504.510485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413504.651525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413504.768898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413504.920030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413505.042130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413505.197850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413505.300309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413505.444002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413505.560176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413505.695944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413505.903158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413506.228697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413506.698236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413506.880215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413507.211597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413507.484503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413507.646462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413507.890014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413508.116860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413508.315560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413508.449436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413508.594418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413508.783937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413508.951077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413509.137577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413509.275809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413509.452966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413509.639492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413509.775949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413509.953257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413510.117754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413510.318215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413510.524211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413510.669302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413510.861911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413511.011112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413511.212309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413511.388154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413511.571643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413511.763460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413511.904689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413512.048230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413512.200189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413512.498646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413512.700256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413513.280469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413513.524024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413513.707506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413513.897982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413514.077475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413514.239094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413514.444641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413514.608666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413514.763247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413514.950873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413515.123623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413515.289109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413515.463768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413515.632444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413515.824522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413515.983022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413516.217715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413516.458901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413516.654394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413516.808924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413516.923299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413517.055708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413517.192971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413517.321943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413517.449642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413517.590991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413517.712522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413517.855537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413517.980153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413518.121455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413518.255727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413518.372339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413518.491507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413518.626562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413518.745838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413518.876308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413519.000841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413519.126896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413519.296383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413519.500680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413519.628086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413519.754933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413519.873679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413520.035924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413520.130592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413520.261353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413520.399332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413520.516944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413520.652416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413520.787082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413520.915132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413521.045221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413521.174276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413521.298886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413521.430540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413521.568275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413521.688327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413521.812737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413521.946137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413522.075169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413522.195717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413522.348717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413522.457427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413522.588803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413522.709183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413522.840463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413522.965000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413523.091220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413523.232262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413523.357571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413523.499960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413523.631636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413523.753081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413523.879919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413524.013270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413524.150916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413524.272692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413524.405733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413524.553035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413524.687116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413524.816157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413524.942801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413525.066992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413525.210799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413525.329881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413525.463013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413525.585603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413525.702185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413525.816460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413525.943553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413526.085410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413526.207736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413526.337451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413526.481671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413526.608582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413526.743572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413526.860157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413526.991989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413527.118148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413527.251770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413527.373509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413527.498688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413527.621741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413527.756520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413527.888666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413528.045187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413528.152197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413528.286646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413528.427297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413528.565550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413528.683737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413528.822103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413528.940889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413529.071576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413529.191297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413529.316938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413529.445635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413529.571033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413529.710873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413529.817775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413529.957066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413530.073745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413530.198987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413530.334818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413530.450047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413530.582297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413530.705354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413530.852057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413530.963645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413531.105555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413531.237926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413531.368073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413531.486426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413531.623128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413531.744679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413531.902007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413532.019223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413532.161550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413532.267025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413532.430284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413532.540093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413532.674672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413532.815171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413532.937357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413533.070596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413533.195570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413533.314634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413533.436685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413533.559669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413533.695668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413533.818397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413533.938601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413534.064739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413534.199303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413534.327040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413534.456623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413534.574956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413534.703494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413534.828061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413534.957018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413535.091601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413535.226627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413535.356930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413535.494450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413535.621706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413535.770626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413535.881084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413536.029298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413536.135447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413536.269542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413536.394313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413536.537955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413536.666946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413536.811900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413536.937487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413537.066361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413537.197661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413537.322027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413537.454273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413537.589632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413537.704611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413537.835355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413537.961302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413538.111483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413538.220396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413538.372554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413538.502284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413538.638774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413538.771039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413538.898238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413539.036336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413539.177115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413539.299031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413539.424959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413539.556769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413539.687158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413539.810642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413539.943719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413540.062611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413540.219934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413540.321515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413540.450764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413540.585436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413540.730290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413540.869581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413540.984965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413541.114781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413541.248327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413541.363967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413541.488904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413541.619906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413541.752293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413541.879168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413542.002354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413542.139116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413542.255820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413542.391637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413542.512364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413542.649220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413542.779986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413542.897371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413543.042917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413543.165201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413543.308732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413543.441550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413543.569568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413543.703925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413543.820822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413543.941041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413544.070686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413544.192640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413544.319365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413544.457013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413544.583620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413544.710222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413544.838697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413544.945571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413545.073104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413545.192970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413545.319632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413545.446994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413545.585105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413545.699120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413545.833308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413545.959983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413546.097971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413546.234546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413546.358666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413546.500032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413546.628292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413546.769537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413546.881158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413547.007074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413547.135704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413547.253349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413547.382073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413547.506359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413547.639389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413547.752974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413547.883800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413548.009172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413548.132746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413548.253790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413548.383157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413548.509493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413548.639198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413548.772326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413548.919939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413549.044996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413549.175092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413549.308620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413549.439378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413549.563354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413549.688614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413549.832914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413549.940119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413550.069651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413550.190969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413550.314176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413550.441188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413550.568252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413550.694168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413550.817740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413550.961751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413551.087744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413551.234577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413551.353050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413551.494167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413551.612662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413551.734148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413551.877776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413552.006193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413552.130351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413552.256595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413552.381455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413552.509474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413552.633861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413552.761764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413552.888226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413553.036827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413553.166683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413553.310457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413553.437844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413553.567191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413553.691647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413553.831821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413553.941053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413554.065825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413554.191906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413554.316604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413554.443483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413554.585402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413554.691311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413554.821193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413554.941538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413555.091627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413555.197699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413555.335806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413555.471089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413555.588546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413555.711942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413555.851507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413555.974408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413556.099980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413556.235443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413556.362981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413556.494388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413556.621770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413556.746683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413556.880460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413556.993300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413557.135535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413557.255830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413557.383549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413557.511628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413557.641757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413557.776043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413557.915119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413558.044598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413558.177447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413558.305862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413558.439125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413558.558452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413558.690503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413558.812920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413558.940223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413559.067888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413559.194065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413559.332662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413559.446551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413559.571970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413559.706978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413559.825861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413559.959897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413560.087627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413560.222444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413560.360480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413560.483643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413560.626686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413560.756019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413560.881020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413561.013170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413561.144117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413561.278610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413561.419996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413561.554765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413561.677152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413561.812886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413561.958717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413562.097311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413562.230452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413562.359775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413562.489301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413562.615722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413562.747963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413562.882442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413563.000865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413563.129194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413563.249639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413563.372120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413563.505368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413563.621263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413563.747425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413563.886481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413564.012698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413564.141281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413564.270267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413564.404821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413564.547571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413564.682277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413564.808662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413564.931822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413565.052043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413565.180996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413565.311197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413565.432703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413565.561013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413565.687065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413565.815778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413565.936536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413566.063601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413566.184485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413566.313163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413566.437258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413566.567768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413566.691054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413566.810577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413566.951314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413567.195206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413567.333329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413567.456981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413567.585790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413567.706462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413567.858802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413567.984730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413568.117108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413568.251139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413568.376149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413568.511480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413568.638560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413568.760911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413568.898080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413569.013445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413569.140027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413569.294168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413569.414680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413569.553735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413569.676732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413569.814317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413569.936832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413570.073452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413570.187342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413570.336630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413570.440930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413570.566962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413570.692541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413570.822290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413570.940019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413571.071324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413571.193470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413571.328751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413571.450319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413571.592315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413571.710519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413571.847274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413571.984710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413572.119547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413572.248439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413572.381026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413572.508049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413572.637312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413572.758732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413572.890026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413573.022337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413573.151099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413573.285571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413573.455611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413573.569413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413573.697526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413573.812107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413573.946269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413574.068966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413574.211623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413574.320948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413574.460479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413574.581307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413574.733563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413574.852655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413574.998775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413575.120599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413575.272157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413575.395745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413575.507103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413575.633880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413575.761296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413575.914768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413576.054170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413576.192817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413576.311521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413576.433182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413576.561166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413576.678449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413576.812828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413576.930436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413577.061530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413577.181634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413577.313191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413577.435167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413577.575574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413577.706806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413577.822906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413577.947832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413578.082096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413578.209840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413578.341330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413578.452483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413578.582977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413578.723145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413578.858335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413578.984132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413579.116239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413579.245544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413579.377454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413579.487961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413579.625283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413579.742256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413579.884744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413580.022177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413580.134778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413580.258594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413580.384301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413580.507486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413580.640252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413580.763586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413580.899388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413581.036383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413581.182170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413581.304622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413581.439911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413581.559502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413581.702136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413581.834222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413581.970915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413582.088701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413582.234771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413582.367844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413582.497696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413582.615903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413582.759300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413582.870668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413583.017357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413583.127025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413583.245599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413583.378533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413583.509348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413583.629057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413583.789191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413583.885496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413584.025534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413584.156367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413584.295129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413584.418932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413584.543715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413584.684301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413584.810285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413584.936953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413585.068920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413585.198435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413585.334022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413585.455645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413585.571949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413585.696342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413585.825658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413585.948153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413586.076820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413586.251645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413586.483494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413586.743105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413587.026312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413587.315499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413587.508045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413587.640792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413587.764972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413587.902710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413588.035906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413588.169969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413588.328257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413588.440117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413588.565791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413588.691789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413588.813592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413588.948206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413589.071046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413589.231994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413589.362542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413589.483428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413589.617587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413589.758401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413589.871799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413590.003171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413590.148049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413590.360436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413590.482367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413590.618941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413590.738885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413590.869690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413590.994930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413591.188501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413591.321488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413591.459786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413591.588018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413591.715014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413591.858930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413592.010950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413592.181980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413592.317513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413592.441864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413592.569915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413592.708761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413592.841410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413592.951520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413593.086029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413593.219100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413593.356788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413593.484621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413593.617102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413593.737563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413593.863544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413593.990698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413594.128773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413594.254085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413594.384515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413594.506372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413594.638059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413594.758985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413594.891061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413595.019824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413595.188281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413595.317495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413595.441597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413595.583290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413595.697627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413595.823903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413595.949865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413596.074955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413596.219413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413596.342614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413596.472292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413596.605162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413596.737335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413596.867080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413596.996477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413597.123475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413597.252962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413597.391951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413597.502613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413597.631302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413597.765778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413597.878243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413598.002856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413598.132087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413598.265623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413598.388829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413598.513772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413598.649349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413598.775057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413598.910561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413599.034884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413599.160499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413599.297176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413599.427893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413599.563181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413599.689708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413599.814661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413599.941786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413600.074493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413600.208282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413600.323202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413600.464671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413600.588284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413600.730609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413600.857916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413600.989780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413601.118869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413601.247508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413601.376115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413601.498165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413601.627230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413601.769480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413601.883458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413602.001972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413602.142497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413602.258871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413602.398151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413602.516971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413602.644661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413602.773430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413602.906564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413603.043608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413603.171257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413603.296792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413603.435262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413603.565815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413603.684617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413603.808202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413603.948265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413604.059131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413604.191172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413604.320385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413604.446588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413604.582203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413604.707879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413604.836465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413604.980307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413605.095627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413605.239083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413605.360026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413605.496658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413605.625870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413605.754699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413605.885091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413606.010029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413606.146338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413606.278230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413606.414926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413606.573676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413606.681983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413606.830366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413606.946863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413607.067334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413607.200077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413607.326658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413607.449441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413607.586507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413607.720213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413607.856856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413607.990671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413608.121041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413608.248172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413608.394188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413608.505501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413608.633174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413608.760225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413608.895175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413609.017793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413609.144837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413609.279183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413609.416051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413609.553010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413609.682650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413609.808598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413609.935669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413610.057806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413610.188555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413610.318125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413610.437205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413610.574501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413610.694730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413610.832282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413610.964831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413611.083111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413611.233311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413611.359117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413611.502345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413611.620682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413611.756701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413611.883759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413612.009155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413612.131841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413612.274032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413612.385215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413612.519432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413612.647704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413612.790098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413612.923034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413613.054767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413613.190329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413613.316914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413613.449010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413613.582216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413613.681090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413613.803974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413613.947376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413614.061548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413614.187048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413614.316409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413614.439910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413614.581336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413614.687128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413614.825345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413614.948587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413615.080494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413615.214595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413615.348763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413615.480135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413615.617259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413615.739426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413615.877063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413615.996063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413616.131381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413616.252784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413616.380790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413616.505769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413616.647175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413616.779673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413616.929292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413617.036854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413617.174100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413617.287022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413617.424085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413617.551517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413617.674925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413617.822495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413617.941536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413618.063262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413618.192121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413618.333986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413618.446138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413618.571912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413618.701096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413618.835760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413618.970252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413619.107600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413619.249598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413619.371944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413619.498080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413619.630260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413619.751139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413619.887532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413620.036011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413620.166844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413620.297655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413620.420016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413620.562416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413620.688277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413620.817880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413620.958382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413621.061212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413621.184203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413621.309004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413621.443246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413621.562536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413621.695197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413621.819875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413621.981826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413622.110684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413622.232476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413622.368675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413622.486436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413622.629771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413622.750527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413622.884898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413623.003886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413623.130857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413623.252772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413623.385071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413623.507855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413623.645339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413623.776080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413623.923573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413624.053653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413624.185730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413624.312201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413624.435272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413624.561134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413624.686915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413624.816867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413624.946368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413625.067889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413625.208372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413625.376471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413625.501167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413625.626218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413625.783872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413626.048702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413626.394526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413626.676490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413627.112512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413627.308398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413627.513068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413627.645916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413627.894783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413628.077465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413628.236086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413628.408686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413628.609974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413628.745156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413628.954723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413629.087127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413629.293351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413629.440380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413629.606637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413629.826022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413629.984485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413630.117312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413630.304457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413630.450417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413630.628062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413630.804578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413631.001148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413631.204954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413631.388882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413631.511356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413631.686593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413631.832274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413632.010329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413632.182286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413632.447500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413632.660569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413632.823297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413632.943327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413633.105998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413633.269852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413633.418399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413633.606382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413633.769153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413633.939992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413634.107438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413634.273514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413634.467380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413634.646121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413634.814078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413635.010379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413635.167979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413635.346660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413635.512427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413635.716119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413635.884852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413636.153165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413636.406719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413636.565023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413636.691123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413636.808677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413636.941194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413637.065020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413637.198012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413637.318329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413637.442733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413637.567977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413637.696981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413637.825890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413637.955371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413638.084720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413638.229972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413638.352555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413638.489829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413638.626540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413638.752877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413638.878648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413639.012710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413639.140762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413639.378543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413639.508731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413639.634927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413639.760065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413639.884259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413640.023531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413640.143346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413640.294171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413640.425096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413640.545800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413640.678660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413640.802606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413640.944619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413641.061810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413641.191264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413641.325337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413641.457103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413641.567659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413641.691383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413641.822160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413641.945504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413642.070769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413642.208734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413642.336076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413642.479466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413642.610702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413642.752919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413642.858718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413643.004926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413643.118399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413643.253631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413643.370648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413643.503679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413643.622012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413643.770603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413643.876874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413644.007492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413644.123879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413644.256251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413644.380693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413644.525906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413644.649612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413644.779173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413644.913307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413645.050917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413645.169459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413645.307848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413645.427255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413645.572003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413645.680948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413645.820769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413645.940100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413646.059667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413646.188399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413646.318613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413646.439573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413646.562335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413646.688176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413646.817869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413646.938447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413647.068876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413647.210382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413647.337901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413647.443745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413647.581565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413647.701781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413647.836990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413647.956964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413648.106591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413648.229258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413648.370296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413648.488063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413648.625209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413648.752708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413648.883384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413649.007252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413649.144181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413649.264006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413649.422198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413649.536008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413649.678348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413649.797141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413649.941628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413650.061099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413650.189971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413650.317253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413650.442524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413650.568769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413650.706270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413650.834906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413650.975939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413651.106512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413651.246843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413651.366083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413651.493804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413651.623087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413651.750055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413651.892463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413652.026996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413652.154299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413652.294949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413652.430681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413652.564811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413652.690202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413652.825183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413652.939006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413653.087835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413653.196884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413653.324537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413653.447910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413653.577165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413653.696725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413653.840342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413653.977515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413654.107348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413654.236217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413654.385228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413654.498035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413654.627647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413654.752689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413654.880065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413655.009762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413655.129436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413655.270258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413655.380752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413655.504585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413655.645629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413655.751237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413655.883678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413656.008869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413656.151864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413656.287644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413656.413095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413656.549552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413656.675390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413656.811899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413656.938646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413657.072733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413657.191303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413657.322713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413657.438330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413657.562440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413657.692302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413657.814713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413657.971366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413658.079845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413658.214438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413658.348977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413658.491844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413658.618543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413658.758314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413658.884785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413659.016536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413659.144882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413659.274096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413659.404630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413659.542229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413659.665549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413659.811557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413659.924064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413660.051839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413660.188509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413660.306409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413660.426747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413660.567544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413660.679265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413660.814459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413660.954974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413661.068432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413661.204583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413661.354791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413661.462842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413661.600339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413661.732572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413661.877524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413661.989836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413662.123729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413662.242261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413662.377065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413662.508142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413662.629245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413662.748269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413662.893474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413663.000360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413663.131853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413663.272770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413663.395071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413663.509637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413663.641070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413663.759483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413663.890918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413664.020147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413664.149932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413664.286598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413664.440185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413664.550524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413664.689627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413664.810065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413664.941261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413665.075388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413665.191912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413665.314635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413665.453935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413665.582826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413665.711198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413665.838739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413665.982090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413666.121628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413666.248809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413666.376179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413666.494936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413666.624615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413666.754805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413666.876857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413667.012155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413667.131540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413667.261900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413667.393999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413667.516922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413667.646435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413667.789160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413667.921488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413668.051711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413668.199484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413668.315129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413668.432096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413668.562694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413668.688219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413668.809789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413668.937313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413669.072312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413669.194486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413669.347819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413669.455926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413669.584321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413669.715264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413669.854181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413669.983075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413670.107122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413670.246357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413670.380040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413670.500789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413670.629905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413670.752602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413670.877613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413671.004410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413671.140687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413671.266021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413671.390104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413671.522403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413671.659459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413671.787195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413671.918430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413672.045964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413672.184512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413672.306168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413672.452652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413672.561707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413672.699307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413672.822078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413672.974070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413673.104620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413673.229542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413673.356774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413673.488581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413673.611100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413673.744056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413673.862503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413673.992321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413674.114208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413674.245467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413674.372306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413674.506329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413674.629810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413674.760060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413674.882778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413675.012178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413675.139919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413675.281465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413675.408384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413675.539453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413675.666738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413675.808048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413675.937364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413676.066511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413676.192874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413676.324423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413676.449904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413676.575944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413676.704070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413676.849559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413676.976434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413677.119268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413677.237510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413677.360979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413677.503395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413677.636735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413677.768679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413677.895652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413678.027731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413678.174590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413678.289613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413678.433175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413678.549290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413678.681865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413678.808771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413678.935476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413679.058791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413679.181083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413679.314878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413679.456413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413679.564126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413679.691264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413679.831950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413679.974646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413680.099541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413680.232522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413680.363812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413680.492835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413680.622428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413680.748602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413680.873195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413681.004725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413681.127386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413681.251539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413681.376702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413681.505332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413681.643068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413681.762700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413681.921601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413682.056310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413682.173358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413682.310158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413682.430453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413682.558470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413682.693146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413682.807676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413682.925687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413683.050286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413683.184985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413683.314142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413683.437952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413683.565255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413683.698841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413683.819875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413683.944888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413684.085120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413684.213058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413684.351860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413684.475068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413684.603918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413684.735164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413684.874323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413684.993354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413685.122696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413685.239818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413685.362219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413685.495782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413685.693695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413685.803119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413685.933726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413686.048312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413686.188000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413686.313868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413686.437660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413686.576873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413686.688211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413686.818353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413686.956426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413687.123401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413687.291608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413687.425259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413687.561267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413687.685177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413687.846915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413687.954412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413688.083087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413688.209127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413688.363204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413688.486689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413688.621584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413688.745511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413688.879996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413688.996737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413689.124035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413689.262909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413689.395717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413689.504735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413689.625830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413689.756567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413689.898009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413690.018857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413690.142007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413690.272046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413690.412717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413690.543871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413690.668833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413690.807320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413690.931499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413691.054765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413691.184863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413691.302910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413691.440563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413691.557911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413691.686972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413691.809768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413691.946075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413692.070167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413692.187238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413692.327539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413692.459953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413692.588151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413692.725325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413692.839683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413692.989753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413693.112836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413693.251889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413693.369250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413693.498956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413693.624414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413693.751855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413693.871626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413694.003476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413694.121899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413694.253684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413694.374360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413694.516218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413694.625965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413694.757815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413694.879634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413694.998864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413695.128148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413695.257350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413695.378524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413695.522813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413695.657016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413695.769552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413695.918474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413696.058960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413696.179932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413696.316114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413696.460494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413696.575072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413696.697467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413696.852075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413696.962705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413697.118282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413697.246314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413697.392659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413697.496145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413697.626052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413697.754106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413697.887896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413698.024498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413698.154154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413698.287226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413698.423183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413698.563864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413698.693764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413698.812949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413698.943948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413699.078847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413699.191971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413699.315841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413699.436134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413699.558380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413699.694071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413699.818783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413699.956126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413700.081824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413700.209540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413700.344437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413700.479837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413700.613125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413700.754547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413700.883290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413701.005492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413701.132704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413701.266424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413701.398315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413701.548871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413701.669314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413701.814445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413701.942497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413702.078493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413702.194724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413702.332397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413702.478206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413702.599946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413702.724946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413702.857434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413702.983826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413703.114778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413703.239018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413703.369216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413703.484665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413703.626332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413703.746828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413703.878263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413704.002694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413704.127280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413704.256325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413704.394207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413704.506260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413704.637574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413704.769229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413704.927155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413705.040757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413705.184483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413705.327974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413705.436074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413705.561502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413705.692399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413705.812297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413705.962097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413706.068043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413706.208590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413706.329016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413706.453878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413706.594291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413706.728102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413706.868167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413707.008167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413707.123067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413707.270966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413707.378751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413707.502340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413707.622894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413707.752759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413707.880870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413708.024906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413708.162804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413708.299667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413708.426678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413708.551397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413708.681327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413708.810436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413708.936435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413709.065121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413709.188003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413709.315380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413709.436004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413709.564264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413709.693952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413709.828809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413709.959596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413710.090061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413710.237295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413710.350815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413710.493349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413710.623595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413710.737967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413710.870332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413710.998758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413711.132195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413711.256268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413711.384846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413711.510386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413711.638574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413711.766660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413711.917602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413712.058506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413712.204622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413712.326780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413712.451384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413712.581444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413712.723382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413712.850265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413712.984112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413713.110434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413713.242370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413713.373464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413713.505314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413713.627350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413713.763877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413713.891205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413714.035127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413714.151257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413714.309752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413714.422384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413714.560899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413714.673964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413714.803291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413714.926255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413715.057065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413715.191498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413715.316808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413715.440761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413715.571438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413715.706506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413715.823933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413715.957349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413716.089883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413716.227503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413716.400206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413716.518326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413716.652022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413716.789946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413716.916507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413717.048793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413717.171259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413717.302598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413717.440579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413717.562706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413717.687380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413717.810185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413717.936523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413718.066758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413718.185547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413718.315776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413718.441496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413718.571841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413718.703293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413718.828712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413718.965832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413719.084227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413719.221775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413719.353507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413719.479204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413719.626958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413719.747317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413719.881807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413719.999438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413720.125696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413720.257097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413720.377648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413720.502023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413720.639898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413720.775287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413720.912922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413721.042852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413721.171714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413721.299357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413721.425905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413721.570878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413721.680668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413721.812031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413721.941092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413722.061997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413722.192975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413722.318995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413722.446500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413722.580418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413722.714119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413722.853892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413722.989981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413723.114184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413723.233858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413723.372897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413723.493720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413723.624379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413723.740547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413723.874371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413723.999270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413724.120485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413724.246851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413724.375710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413724.497448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413724.644878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413724.756974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413724.881515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413725.014851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413725.141578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413725.272806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413725.421786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413725.542058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413725.668254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413725.807235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413725.936230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413726.053254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413726.185931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413726.303966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413726.433526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413726.564590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413726.696253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413726.817916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413726.977560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413727.079723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413727.207325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413727.344551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413727.470767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413727.608485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413727.744681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413727.879139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413728.001285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413728.127845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413728.248154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413728.391738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413728.516222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413728.626426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413728.757962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413728.884376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413729.052637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413729.166816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413729.298885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413729.429555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413729.560307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413729.677457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413729.807830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413729.930063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413730.055503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413730.186919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413730.312551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413730.437239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413730.570779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413730.712035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413730.820717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413730.948628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413731.085946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413731.224566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413731.366061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413731.489221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413731.623379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413731.743301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413731.876821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413732.004985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413732.129568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413732.257038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413732.380825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413732.515542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413732.650306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413732.776820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413732.932625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413733.052292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413733.185601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413733.311594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413733.441420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413733.560590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413733.690932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413733.813162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413733.955484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413734.082417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413734.194848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413734.326145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413734.452251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413734.599688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413734.729900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413734.873819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413735.006623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413735.129843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413735.252711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413735.380602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413735.518875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413735.641439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413735.771061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413735.897444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413736.042026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413736.168041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413736.308240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413736.433805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413736.554469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413736.674422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413736.806566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413736.925676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413737.060844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413737.184069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413737.311596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413737.452243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413737.580847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413737.699162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413737.832370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413737.959663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413738.116746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413738.242034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413738.369831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413738.489826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413738.625314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413738.762654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413738.874870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413738.998347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413739.144888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413739.249285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413739.382856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413739.515437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413739.638891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413739.769009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413739.926200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413740.051788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413740.173731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413740.307199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413740.445104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413740.554629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413740.682455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413740.811632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413740.938148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413741.062313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413741.189626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413741.311635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413741.440273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413741.564393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413741.692687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413741.822793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413741.962741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413742.095827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413742.218532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413742.355075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413742.489926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413742.609785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413742.748670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413742.872466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413743.000098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413743.123737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413743.249954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413743.375297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413743.502027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413743.623801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413743.752647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413743.914531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413744.026040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413744.152695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413744.289738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413744.423045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413744.558011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413744.684521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413744.813934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413744.930867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413745.067930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413745.186913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413745.342665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413745.502300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413745.619063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413745.739601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413745.893217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413746.144863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413746.593065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413746.877798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413747.135091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413747.437178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413747.647575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413747.864588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413748.056353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413748.264591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413748.494972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413748.643629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413748.830169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413749.002937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413749.195117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413749.375688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413749.522785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413749.680268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413749.882363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413750.056787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413750.226091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413750.387925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413750.569820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413750.742055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413750.895227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413751.068350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413751.257652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413751.497116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413751.684562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413751.838915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413752.002156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413752.141364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413752.323362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413752.511176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413752.829477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413753.192344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413753.369373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413753.579142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413753.755977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413753.939400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413754.111494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413754.252880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413754.415362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413754.606501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413754.790510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413754.954240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413755.115591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413755.272106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413755.418318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413755.582124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413755.740612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413755.955621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413756.097135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413756.278904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413756.477192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413756.787304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413756.986172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413757.138700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413757.292480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413757.412029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413757.554090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413757.677747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413757.806211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413757.946660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413758.064327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413758.203910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413758.314244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413758.442794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413758.586035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413758.692656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413758.822171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413758.950668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413759.094789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413759.225575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413759.362578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413759.491977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413759.665144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413759.896424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413760.025105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413760.177608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413760.298743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413760.422629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413760.553072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413760.681977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413760.807696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413760.953162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413761.062369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413761.178816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413761.310647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413761.442208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413761.560466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413761.709508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413761.817448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413761.945962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413762.077926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413762.200312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413762.317492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413762.445649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413762.566938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413762.702549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413762.823479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413762.956471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413763.085872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413763.223037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413763.349478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413763.497022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413763.627832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413763.744403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413763.878812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413764.004431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413764.129125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413764.257640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413764.403677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413764.519744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413764.650627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413764.776054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413764.934199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413765.061575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413765.186298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413765.313927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413765.439198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413765.570282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413765.704339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413765.817928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413765.943558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413766.084573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413766.208125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413766.334659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413766.479765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413766.613198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413766.739405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413766.871927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413766.995542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413767.123698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413767.245771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413767.390202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413767.497818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413767.630708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413767.755667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413767.889490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413768.020622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413768.166999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413768.286785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413768.431318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413768.557484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413768.675545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413768.802691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413768.933583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413769.057201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413769.183887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413769.306443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413769.438549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413769.553709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413769.688281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413769.806502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413769.943394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413770.079211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413770.195463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413770.319517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413770.457938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413770.603935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413770.722897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413770.855146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413770.964530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413771.113018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413771.249915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413771.363824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413771.503319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413771.620336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413771.756057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413771.909961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413772.057513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413772.182592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413772.311149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413772.444089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413772.566574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413772.692208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413772.816896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413772.956062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413773.076828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413773.205241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413773.352908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413773.489458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413773.621548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413773.751783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413773.876885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413774.000458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413774.121445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413774.248373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413774.376007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413774.495871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413774.627795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413774.767732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413774.889993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413775.014973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413775.133903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413775.247114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413775.391199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413775.502642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413775.628409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413775.751168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413775.878837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413776.004081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413776.130562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413776.273316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413776.394795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413776.537964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413776.658580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413776.790713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413776.916498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413777.046478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413777.182731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413777.307061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413777.443027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413777.554502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413777.685350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413777.815822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413777.929785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413778.062776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413778.187184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413778.319422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413778.429766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413778.552588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413778.689685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413778.815044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413778.947458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413779.069355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413779.201460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413779.329152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413779.455505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413779.586647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413779.731883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413779.863778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413779.995854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413780.119742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413780.250005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413780.388504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413780.502310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413780.627525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413780.756386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413780.881626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413781.019931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413781.155092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413781.268734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413781.411912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413781.550544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413781.669303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413781.812147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413781.922075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413782.063779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413782.180588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413782.303549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413782.432373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413782.562758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413782.686939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413782.809448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413782.938413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413783.071972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413783.185814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413783.319230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413783.435671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413783.552081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413783.691618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413783.828863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413783.957744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413784.080995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413784.224912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413784.358227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413784.478640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413784.630604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413784.743333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413784.873431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413784.996060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413785.127411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413785.251401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413785.374331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413785.498677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413785.623499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413785.750854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413785.877067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413786.001311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413786.154969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413786.269511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413786.406817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413786.537122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413786.667599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413786.801887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413786.930171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413787.052920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413787.181478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413787.307040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413787.436575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413787.558076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413787.683784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413787.805957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413787.935632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413788.066081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413788.175928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413788.306133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413788.432951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413788.575450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413788.689087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413788.811462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413788.938853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413789.065267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413789.195352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413789.315425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413789.439876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413789.564293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413789.691795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413789.828387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413789.954053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413790.078983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413790.215485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413790.336565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413790.477234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413790.608512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413790.734674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413790.869097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413790.998304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413791.124341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413791.247201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413791.373416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413791.497580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413791.620129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413791.751860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413791.876207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413792.014455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413792.136898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413792.274566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413792.396273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413792.534923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413792.662334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413792.803526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413792.925220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413793.074749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413793.190621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413793.315566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413793.440614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413793.571321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413793.699933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413793.827664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413793.955083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413794.100389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413794.221715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413794.362242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413794.482104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413794.629875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413794.737193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413794.873239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413795.000127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413795.120727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413795.239561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413795.367130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413795.500208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413795.621059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413795.745118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413795.869056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413796.007146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413796.126438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413796.251291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413796.379354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413796.501430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413796.639000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413796.769345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413796.909448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413797.038291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413797.201868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413797.311143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413797.437524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413797.570123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413797.707622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413797.837090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413797.957226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413798.102792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413798.238477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413798.357814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413798.491592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413798.617753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413798.744158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413798.872102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413798.997016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413799.117977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413799.262798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413799.376162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413799.505227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413799.639399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413799.780152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413799.926810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413800.057519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413800.186541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413800.314792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413800.438758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413800.575217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413800.685550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413800.817158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413800.937329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413801.082248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413801.190173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413801.353579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413801.459629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413801.599768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413801.734911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413801.880240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413802.028142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413802.161422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413802.291271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413802.426826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413802.553704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413802.689109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413802.804143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413802.925894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413803.071564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413803.193538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413803.307884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413803.437185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413803.559055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413803.691732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413803.811746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413803.945992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413804.071012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413804.211064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413804.356552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413804.471627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413804.607681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413804.738562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413804.863903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413805.000423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413805.119071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413805.231106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413805.367818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413805.493972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413805.618142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413805.748918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413805.865719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413805.991404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413806.110716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413806.239140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413806.360692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413806.491397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413806.622129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413806.748806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413806.883750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413806.996290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413807.208730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413807.367324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413807.502351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413807.628781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413807.772601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413807.930673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413808.051307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413808.180080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413808.307750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413808.434957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413808.561078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413808.684832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413808.816494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413808.939427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413809.080447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413809.202766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413809.346383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413809.475688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413809.630357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413809.734822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413809.870191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413809.996287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413810.128982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413810.244746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413810.380070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413810.497696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413810.624981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413810.755226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413810.889943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413811.018344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413811.152568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413811.284009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413811.411929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413811.541270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413811.667058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413811.798013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413811.932026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413812.056764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413812.188931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413812.319566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413812.451639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413812.574647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413812.722367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413812.852355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413812.975570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413813.109981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413813.227760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413813.361781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413813.493216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413813.617434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413813.758118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413813.872788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413813.996893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413814.124935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413814.261024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413814.396801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413814.536569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413814.668510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413814.802659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413814.926074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413815.068879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413815.184182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413815.309559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413815.435889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413815.565615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413815.692631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413815.827134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413815.966586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413816.107161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413816.232074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413816.374045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413816.493102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413816.627883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413816.751099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413816.879287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413817.002296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413817.142023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413817.279018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413817.399641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413817.535515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413817.664367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413817.797325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413817.927914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413818.054601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413818.201177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413818.320965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413818.440324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413818.556799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413818.704511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413818.828250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413818.950540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413819.075472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413819.208106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413819.342477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413819.480310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413819.609478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413819.745476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413819.887268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413820.002410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413820.127496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413820.258358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413820.382140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413820.536036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413820.655854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413820.768102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413820.911668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413821.051718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413821.179118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413821.305683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413821.430106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413821.557691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413821.676260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413821.815117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413821.948130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413822.073008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413822.207050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413822.344222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413822.487431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413822.611234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413822.745846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413822.872403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413822.993526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413823.140226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413823.247920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413823.386873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413823.499843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413823.646467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413823.754760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413823.886566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413824.033696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413824.178272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413824.289274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413824.418370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413824.540188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413824.683732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413824.801538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413824.950427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413825.061795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413825.193544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413825.307883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413825.429873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413825.559401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413825.693330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413825.807565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413825.936263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413826.061800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413826.201834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413826.325672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413826.464872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413826.586015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413826.725822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413826.853510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413826.989557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413827.112044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413827.249135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413827.368856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413827.492651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413827.616605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413827.751540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413827.870215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413828.002887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413828.126780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413828.248230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413828.374658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413828.504114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413828.638941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413828.762164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413828.883339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413829.021752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413829.167809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413829.301552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413829.427312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413829.573875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413829.685475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413829.812709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413829.929174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413830.079024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413830.192708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413830.335468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413830.453768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413830.596209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413830.728756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413830.861416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413830.979476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413831.119189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413831.247496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413831.377053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413831.496337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413831.621453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413831.741722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413831.899562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413832.041636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413832.181572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413832.308936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413832.434378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413832.565611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413832.720516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413832.829811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413832.975244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413833.102464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413833.234004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413833.361361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413833.489708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413833.609927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413833.736138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413833.866796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413834.012063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413834.123110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413834.249793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413834.371960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413834.496570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413834.620026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413834.772856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413834.877485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413835.004248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413835.136933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413835.271547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413835.421339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413835.568380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413835.676603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413835.816298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413835.926301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413836.078715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413836.186811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413836.315621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413836.443388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413836.577006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413836.709817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413836.847216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413836.985336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413837.117843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413837.231743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413837.369113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413837.511813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413837.617564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413837.744435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413837.870561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413838.010695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413838.129400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413838.250009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413838.388637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413838.508234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413838.632307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413838.754460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413838.881815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413839.014002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413839.142504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413839.277122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413839.416569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413839.546657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413839.673778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413839.804281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413839.939364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413840.071231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413840.189525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413840.310867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413840.438596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413840.564574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413840.699711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413840.829052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413840.977866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413841.103599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413841.233157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413841.360962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413841.488404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413841.619835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413841.742826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413841.870143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413841.997739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413842.122724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413842.262822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413842.370753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413842.501727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413842.627890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413842.758114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413842.890662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413843.033750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413843.164751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413843.297007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413843.425343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413843.561472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413843.682220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413843.806957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413843.950048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413844.067963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413844.187011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413844.309681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413844.441995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413844.569124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413844.700278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413844.824788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413844.963941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413845.098670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413845.220277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413845.366717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413845.482054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413845.617997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413845.737170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413845.851594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413845.986592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413846.117410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413846.243023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413846.371525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413846.495349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413846.627167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413846.744585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413846.877711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413846.999980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413847.127076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413847.267521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413847.404737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413847.515818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413847.659272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413847.785753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413847.919470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413848.045091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413848.176713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413848.304139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413848.444192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413848.556505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413848.687018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413848.811383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413848.948246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413849.073578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413849.202750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413849.324516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413849.455024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413849.588037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413849.723850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413849.860332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413849.997831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413850.124650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413850.252161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413850.377693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413850.504753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413850.630342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413850.759728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413850.896664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413851.030224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413851.154106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413851.286394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413851.415322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413851.551769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413851.669225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413851.807822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413851.933897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413852.055037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413852.180961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413852.311041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413852.437750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413852.583404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413852.701186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413852.832772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413852.983105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413853.116592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413853.231123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413853.366858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413853.490524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413853.622808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413853.744941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413853.872636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413853.995739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413854.123559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413854.251921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413854.369845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413854.495380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413854.616144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413854.748317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413854.875515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413855.003673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413855.138582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413855.263704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413855.388128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413855.520918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413855.650266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413855.790226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413855.925075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413856.050188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413856.185940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413856.299511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413856.430850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413856.598545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413856.804984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413857.046863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413857.261140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413857.443675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413857.688780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413857.868265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413857.986316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413858.123221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413858.364620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413858.495432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413858.622652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413858.743631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413858.872468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413858.992015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413859.120690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413859.255616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413859.384961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413859.513314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413859.657973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413859.765783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413859.942045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413860.056002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413860.178911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413860.314773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413860.428299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413860.569711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413860.683649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413860.806794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413860.935975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413861.061738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413861.222027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413861.346967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413861.467039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413861.616078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413861.734572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413861.874469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413862.015113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413862.151100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413862.272300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413862.419054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413862.559208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413862.700025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413862.813747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413862.932797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413863.064595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413863.199045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413863.331517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413863.468534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413863.599551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413863.728324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413863.868497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413863.991433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413864.129287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413864.254744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413864.393632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413864.491563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413864.628861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413864.762941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413864.878010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413865.003008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413865.134485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413865.252688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413865.381982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413865.516337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413865.653621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413865.780268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413865.909589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413866.044321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413866.179094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413866.300608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413866.433976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413866.555411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413866.698989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413866.981786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413867.346715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413867.704318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413868.032608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413868.306922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413868.504787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413868.697599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413868.899114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413869.127571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413869.302063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413869.472808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413869.630202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413869.799191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413869.985284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413870.157657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413870.305676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413870.456613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413870.629970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413870.831552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413871.004627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413871.162027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413871.321328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413871.498742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413871.692176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413871.824918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413872.033248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413872.178648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413872.437556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413872.677337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413872.827014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413872.994434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413873.142109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413873.317019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413873.457863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413873.625435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413873.880605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413874.128472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413874.306480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413874.439677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413874.581204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413874.714994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413874.895162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413875.050520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413875.204714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413875.407638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413875.589832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413875.760221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413875.984946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413876.121867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413876.291983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413876.470352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413876.642448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413876.817713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413876.984885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413877.144638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413877.326205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413877.502673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413877.699419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413878.017346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413878.177915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413878.407944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413878.536027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413878.663316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413878.790361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413878.926949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413879.046370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413879.189794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413879.303594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413879.429832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413879.568278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413879.677639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413879.806376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413879.932971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413880.061848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413880.184727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413880.310498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413880.452747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413880.564075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413880.694696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413880.831605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413880.998384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413881.221507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413881.351198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413881.482112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413881.608629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413881.733169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413881.860038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413881.992510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413882.117741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413882.237271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413882.367628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413882.496567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413882.618227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413882.762805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413882.872520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413882.997488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413883.124800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413883.252908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413883.387075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413883.516425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413883.658876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413883.784001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413883.924523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413884.055227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413884.174658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413884.300762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413884.424513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413884.566011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413884.690509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413884.816379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413884.950657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413885.073568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413885.225464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413885.346677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413885.473943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413885.614434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413885.734674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413885.876309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413885.980042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413886.123487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413886.313820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413886.566237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413886.766191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413886.947848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413887.088242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413887.203584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413887.334631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413887.479821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413887.606361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413887.729055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413887.858695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413887.999852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413888.119093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413888.245881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413888.385481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413888.503836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413888.637776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413888.781419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413888.909857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413889.045655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413889.175721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413889.303058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413889.428012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413889.574171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413889.683302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413889.847251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413889.942826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413890.066161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413890.201005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413890.316953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413890.437998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413890.567024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413890.699914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413890.823008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413890.950343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413891.096075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413891.227555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413891.345596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413891.492921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413891.622221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413891.754453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413891.892087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413892.014639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413892.162894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413892.279603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413892.409847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413892.535724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413892.671429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413892.793243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413892.948438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413893.058831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413893.186596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413893.308818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413893.425334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413893.556886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413893.687521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413893.813227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413893.946904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413894.076139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413894.207822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413894.330002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413894.460465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413894.593441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413894.722505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413894.855326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413894.987157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413895.112573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413895.239484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413895.368220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413895.493542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413895.620206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413895.752846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413895.868062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413895.992971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413896.123123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413896.264169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413896.368777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413896.496091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413896.626338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413896.751846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413896.877227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413897.012203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413897.135731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413897.281179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413897.406018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413897.536942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413897.663398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413897.797076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413897.915374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413898.058101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413898.190700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413898.307301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413898.428806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413898.581226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413898.689069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413898.820907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413898.939874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413899.077919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413899.198191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413899.339572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413899.472358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413899.611792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413899.735383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413899.879251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413900.012048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413900.139512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413900.262705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413900.394569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413900.519624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413900.643762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413900.783194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413900.914727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413901.042672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413901.176549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413901.298478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413901.435389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413901.562286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413901.685157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413901.812090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413901.938390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413902.075661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413902.192689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413902.328325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413902.461275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413902.577185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413902.716689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413902.841699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413902.979925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413903.115754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413903.242854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413903.362774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413903.488204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413903.612885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413903.746079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413903.878666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413904.021163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413904.144698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413904.281744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413904.411202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413904.537604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413904.666607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413904.801767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413904.923708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413905.053753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413905.177639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413905.306621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413905.424181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413905.559601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413905.680233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413905.813578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413905.936109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413906.077622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413906.190181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413906.338640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413906.451638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413906.577648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413906.721567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413906.862873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413906.976828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413907.117295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413907.250966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413907.369178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413907.499272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413907.620642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413907.742171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413907.871686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413907.996451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413908.124006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413908.251608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413908.374738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413908.498815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413908.623077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413908.751127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413908.880257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413909.013775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413909.140496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413909.283819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413909.412251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413909.539285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413909.660257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413909.789487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413909.928599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413910.049947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413910.179759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413910.298937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413910.425173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413910.552379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413910.682520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413910.798750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413910.932042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413911.059154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413911.191197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413911.306450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413911.434113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413911.558806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413911.690573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413911.822087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413911.971089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413912.095946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413912.239895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413912.366568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413912.503332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413912.618457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413912.764138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413912.868390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413912.995630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413913.123641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413913.261263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413913.386688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413913.519645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413913.643343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413913.777556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413913.906323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413914.060148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413914.177824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413914.306209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413914.428520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413914.559745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413914.684802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413914.805232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413914.934242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413915.060117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413915.179747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413915.304676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413915.426764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413915.553470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413915.685052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413915.800473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413915.926460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413916.059033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413916.180489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413916.303905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413916.438004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413916.576609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413916.677250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413916.810581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413916.932260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413917.062069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413917.186461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413917.311285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413917.442390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413917.569949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413917.694076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413917.816133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413917.950447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413918.082186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413918.222183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413918.378624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413918.481356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413918.616606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413918.742514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413918.865488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413918.993790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413919.117751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413919.238432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413919.379244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413919.489277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413919.622088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413919.746610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413919.888031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413920.010721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413920.151431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413920.287765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413920.408990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413920.571053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413920.683424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413920.802608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413920.934294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413921.064090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413921.181771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413921.310354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413921.447539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413921.574480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413921.721719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413921.852738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413921.996340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413922.115400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413922.252223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413922.383279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413922.511607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413922.632507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413922.761240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413922.890239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413923.019088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413923.143094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413923.270996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413923.414836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413923.555875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413923.674052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413923.808533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413923.936158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413924.060752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413924.200128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413924.339267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413924.447320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413924.583464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413924.705992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413924.842104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413924.976409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413925.106129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413925.232153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413925.358321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413925.488926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413925.613183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413925.739227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413925.869630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413925.987999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413926.116863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413926.245770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413926.384917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413926.497663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413926.637187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413926.804967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413926.935498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413927.058521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413927.200060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413927.326092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413927.437333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413927.559866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413927.717718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413927.844157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413928.005976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413928.200272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413928.323303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413928.454269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413928.613985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413928.722154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413928.856050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413928.983797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413929.119980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413929.245260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413929.393981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413929.532616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413929.655873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413929.765675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413929.911451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413930.034875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413930.178004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413930.296246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413930.423450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413930.547601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413930.684498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413930.804851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413930.938380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413931.064004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413931.194887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413931.311671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413931.449750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413931.580953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413931.719806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413931.851891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413931.983929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413932.100229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413932.236389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413932.366792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413932.497934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413932.622914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413932.763335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413932.887254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413933.014380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413933.158388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413933.288255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413933.423311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413933.559840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413933.684202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413933.811001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413933.936628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413934.071559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413934.197662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413934.312071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413934.437511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413934.562283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413934.683642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413934.820805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413934.941489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413935.072551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413935.202928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413935.334621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413935.469585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413935.607150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413935.730487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413935.880346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413936.010709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413936.136850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413936.262433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413936.396632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413936.532595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413936.662978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413936.800244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413936.924805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413937.050004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413937.182673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413937.308962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413937.453627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413937.560580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413937.681069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413937.809912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413937.940038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413938.057884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413938.183977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413938.312239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413938.441830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413938.561047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413938.689720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413938.823354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413938.960764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413939.092812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413939.222167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413939.357614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413939.473921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413939.607181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413939.743942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413939.870484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413940.009963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413940.150254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413940.265356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413940.390901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413940.520039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413940.658549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413940.788389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413940.944065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413941.056982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413941.180531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413941.314013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413941.437049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413941.570750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413941.711988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413941.845996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413941.970007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413942.113748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413942.234160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413942.351567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413942.484966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413942.635213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413942.749445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413942.882546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413943.004959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413943.138147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413943.297079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413943.429735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413943.546138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413943.679221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413943.799813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413943.927969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413944.048175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413944.181752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413944.303152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413944.429823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413944.572867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413944.687984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413944.816018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413944.951364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413945.081937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413945.227956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413945.350239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413945.485229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413945.620783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413945.730295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413945.855966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413945.993766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413946.116850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413946.272641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413946.385043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413946.509244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413946.641320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413946.774026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413946.902632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413947.052685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413947.173774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413947.296878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413947.423038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413947.548380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413947.674726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413947.804577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413947.925011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413948.054123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413948.176829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413948.336872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413948.437420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413948.575335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413948.701895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413948.834523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413948.962690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413949.100778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413949.228269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413949.356745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413949.478537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413949.611299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413949.732721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413949.864997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413949.989307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413950.117810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413950.238251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413950.387520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413950.497669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413950.633431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413950.773598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413950.881828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413951.013509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413951.157022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413951.285176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413951.423709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413951.552223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413951.670413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413951.824430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413951.957737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413952.094604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413952.215248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413952.340447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413952.468916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413952.597724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413952.751019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413952.864620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413952.991544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413953.127817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413953.253266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413953.377315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413953.506444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413953.633034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413953.763816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413953.907823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413954.063700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413954.181871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413954.310502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413954.437495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413954.574117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413954.702409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413954.830064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413954.957583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413955.095356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413955.230662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413955.370230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413955.488666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413955.638945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413955.760737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413955.883287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413956.009968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413956.158264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413956.281451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413956.420859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413956.548234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413956.670345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413956.795843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413956.929408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413957.048239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413957.179703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413957.302771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413957.429214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413957.551702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413957.682162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413957.806881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413957.941226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413958.064946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413958.189349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413958.314556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413958.451205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413958.580190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413958.718931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413958.840144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413958.976989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413959.102499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413959.239309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413959.379728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413959.497268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413959.620318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413959.750605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413959.874820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413959.999082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413960.127711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413960.261837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413960.377041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413960.528019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413960.652627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413960.797187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413960.918488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413961.049119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413961.175502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413961.306346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413961.433040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413961.576454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413961.698350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413961.840720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413961.959191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413962.093740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413962.218404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413962.355375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413962.491628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413962.621797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413962.758292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413962.868376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413963.000118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413963.136544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413963.259982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413963.413608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413963.542512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413963.669366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413963.791446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413963.927857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413964.064703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413964.180372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413964.303108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413964.428141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413964.562771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413964.682036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413964.806115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413964.927126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413965.053813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413965.183824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413965.312567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413965.443619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413965.573510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413965.722090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413965.844396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413965.976020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413966.108346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413966.251498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413966.361085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413966.497339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413966.618907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413966.740927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413966.868969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413966.991883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413967.115756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413967.245204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413967.365309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413967.498372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413967.624153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413967.756808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413967.887669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413968.029869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413968.158917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413968.279687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413968.411837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413968.552615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413968.680704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413968.808994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413968.944270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413969.054805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413969.174756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413969.304525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413969.424820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413969.556255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413969.685520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413969.806034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413969.934688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413970.063889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413970.187524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413970.331046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413970.469917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413970.603514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413970.728275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413970.870702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413971.001488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413971.119751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413971.245186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413971.373855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413971.510505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413971.624567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413971.752217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413971.885938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413972.022919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413972.163753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413972.285279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413972.415117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413972.549851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413972.692072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413972.800625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413972.927408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413973.048806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413973.193076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413973.312678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413973.429355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413973.559255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413973.697539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413973.823725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413973.949806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413974.078243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413974.217463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413974.338617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413974.486121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413974.598765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413974.722223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413974.856385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413974.994802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413975.107674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413975.242555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413975.385900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413975.491668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413975.621751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413975.743237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413975.870307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413976.024680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413976.138608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413976.279787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413976.413348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413976.549177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413976.670697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413976.803694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413976.934186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413977.058912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413977.185016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413977.304499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413977.430526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413977.558817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413977.686238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413977.821273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413977.963168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413978.101509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413978.226279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413978.357793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413978.492135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413978.614021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413978.736393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413978.868624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413978.987798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413979.119946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413979.238591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413979.390208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413979.497821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413979.625546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413979.749647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413979.919153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413980.040843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413980.171886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413980.298449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413980.425934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413980.552133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413980.680810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413980.806327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413980.933647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413981.056224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413981.182659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413981.304945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413981.437649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413981.559108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413981.688935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413981.826034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413981.982719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413982.114573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413982.241307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413982.366618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413982.491339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413982.625760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413982.747064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413982.882506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413983.009977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413983.121324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413983.259902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413983.389646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413983.530073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413983.652339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413983.789660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413983.924369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413984.053020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413984.184974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413984.311871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413984.424855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413984.556602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413984.675770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413984.806763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413984.925148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413985.071024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413985.179313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413985.324310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413985.435232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413985.559711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413985.683669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413985.830291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413985.948346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413986.124405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413986.289710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413986.413519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413986.534429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413986.670615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413986.790446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413986.923861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413987.046706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413987.172732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413987.291848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413987.421962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413987.538374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413987.696014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413987.950614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413988.241802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413988.523023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413988.868709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413989.180900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413989.471946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413989.672582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413989.898895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413990.146938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413990.291520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413990.427733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413990.615810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413990.801916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413990.947408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413991.130980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413991.285891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413991.452526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413991.654258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413991.796679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413991.955323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413992.156390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413992.293333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413992.487894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413992.624043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413992.812841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413992.980517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413993.132704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413993.302194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413993.498100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413993.724375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413993.869411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413994.050450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413994.189661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413994.342169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413994.502268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413994.663480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413994.892134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413995.178172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413995.310445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413995.451173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413995.576244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413995.734924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413995.886569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413996.091586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413996.300404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413996.448808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413996.618728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413996.823781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413996.994233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638413997.127256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413997.308870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413997.476991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413997.635054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413997.822145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413997.961015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413998.131052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413998.338871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413998.485038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413998.642912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413998.812191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413999.160673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413999.401113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413999.535645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413999.664849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413999.791023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638413999.921410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414000.051848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414000.183043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414000.308168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414000.433171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414000.552237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414000.698024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414000.819630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414000.945513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414001.097352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414001.234882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414001.346646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414001.484627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414001.610765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414001.736537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414001.862488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414002.016981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414002.230661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414002.367970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414002.488412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414002.619083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414002.741012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414002.872743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414002.993721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414003.120116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414003.245867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414003.371192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414003.497265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414003.633912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414003.768276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414003.921628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414004.041094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414004.169483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414004.291987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414004.421526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414004.541732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414004.674318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414004.799454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414004.927304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414005.063019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414005.170978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414005.298472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414005.431973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414005.553095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414005.694273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414005.805660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414005.936908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414006.058763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414006.181372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414006.327542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414006.437850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414006.565691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414006.716487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414006.827776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414006.954536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414007.092873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414007.230060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414007.368982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414007.495187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414007.623595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414007.756390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414007.885003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414008.028061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414008.163282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414008.299428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414008.420309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414008.544311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414008.667983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414008.806044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414008.922977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414009.048231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414009.179891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414009.302492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414009.439751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414009.553214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414009.676176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414009.813147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414009.940687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414010.075199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414010.202475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414010.340270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414010.486746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414010.613020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414010.730425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414010.870272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414010.996295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414011.118515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414011.255220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414011.384140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414011.497788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414011.630495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414011.766075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414011.886473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414012.012902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414012.154919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414012.289258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414012.450027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414012.561998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414012.701116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414012.819458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414012.960172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414013.090548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414013.226681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414013.349444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414013.488242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414013.618217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414013.740358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414013.870896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414013.995998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414014.117979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414014.262335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414014.372121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414014.503614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414014.631296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414014.767546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414014.898530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414015.030222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414015.171266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414015.297351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414015.416112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414015.547037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414015.677333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414015.803112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414015.922625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414016.059072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414016.198502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414016.318999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414016.444989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414016.592822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414016.722178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414016.855054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414016.972440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414017.098703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414017.230734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414017.361085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414017.483150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414017.608598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414017.737252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414017.889700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414018.000786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414018.158533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414018.266161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414018.402011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414018.537456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414018.674074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414018.801703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414018.928802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414019.052282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414019.181311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414019.309797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414019.446262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414019.560147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414019.695343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414019.819474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414019.953130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414020.078040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414020.229367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414020.350601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414020.491830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414020.618281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414020.746760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414020.866625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414020.993635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414021.127253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414021.261908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414021.370315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414021.501028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414021.632210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414021.757934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414021.890921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414022.021365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414022.157128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414022.285980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414022.426570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414022.563558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414022.674927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414022.802262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414022.929186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414023.068706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414023.176629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414023.315575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414023.453830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414023.562321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414023.684066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414023.820251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414023.946263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414024.084444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414024.216262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414024.365068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414024.486218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414024.615443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414024.738720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414024.870311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414024.990216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414025.119550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414025.247399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414025.383228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414025.498976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414025.632045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414025.763108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414025.909656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414026.043139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414026.175177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414026.294623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414026.429595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414026.554295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414026.682347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414026.802986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414026.935297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414027.053524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414027.182884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414027.306077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414027.431550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414027.570650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414027.683761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414027.806804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414027.938980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414028.070881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414028.196729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414028.323790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414028.490219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414028.596004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414028.717365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414028.856135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414028.977290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414029.097005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414029.229851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414029.350964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414029.483521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414029.607810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414029.732655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414029.860917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414029.982354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414030.107859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414030.231391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414030.362387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414030.486493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414030.613485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414030.736647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414030.852716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414030.984860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414031.111520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414031.236805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414031.365925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414031.491011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414031.619775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414031.762842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414031.872312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414031.994184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414032.130333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414032.263740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414032.395962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414032.533614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414032.673815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414032.802464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414032.928889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414033.054802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414033.194593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414033.306002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414033.425122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414033.554324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414033.684027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414033.815069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414033.934324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414034.088329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414034.185449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414034.316837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414034.436697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414034.571805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414034.698411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414034.837699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414034.976552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414035.106632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414035.233563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414035.365103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414035.483840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414035.613612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414035.735412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414035.865941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414035.986355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414036.113697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414036.231129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414036.381799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414036.488873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414036.623493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414036.744981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414036.873490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414037.000422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414037.155328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414037.267446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414037.410650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414037.534742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414037.661564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414037.798731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414037.917946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414038.046621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414038.187627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414038.308734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414038.433630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414038.554753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414038.679974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414038.810177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414038.965190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414039.069592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414039.198756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414039.326258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414039.453220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414039.605844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414039.726178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414039.859562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414039.988537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414040.112646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414040.240010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414040.367133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414040.511983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414040.623892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414040.746499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414040.881864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414040.989865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414041.118454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414041.265054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414041.376913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414041.505219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414041.635388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414041.770718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414041.932173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414042.052896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414042.175963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414042.308279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414042.423348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414042.554017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414042.679786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414042.809496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414042.934461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414043.052053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414043.180981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414043.309316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414043.449008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414043.558967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414043.683138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414043.807269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414043.945223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414044.083858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414044.215260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414044.352591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414044.492395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414044.615403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414044.733025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414044.861701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414044.987767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414045.105158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414045.241301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414045.361776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414045.485870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414045.612232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414045.742142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414045.862205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414045.989311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414046.117336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414046.238899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414046.367225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414046.507164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414046.620601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414046.748297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414046.905870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414047.062110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414047.198650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414047.335603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414047.446983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414047.590155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414047.748635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414047.873492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414047.993310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414048.113909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414048.249246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414048.382286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414048.500770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414048.622679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414048.749444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414048.882389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414049.051806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414049.221618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414049.361640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414049.482232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414049.618555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414049.743568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414049.877309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414050.003728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414050.133077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414050.269690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414050.405875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414050.539805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414050.676700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414050.798799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414050.927261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414051.051193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414051.180713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414051.307061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414051.439420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414051.572254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414051.714252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414051.845707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414051.972627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414052.104929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414052.229343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414052.357891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414052.493564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414052.621258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414052.746163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414052.865646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414052.995595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414053.128363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414053.254610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414053.383249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414053.518042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414053.657476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414053.780318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414053.945261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414054.057414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414054.179619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414054.316743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414054.443703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414054.591290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414054.717778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414054.863012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414054.985800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414055.121060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414055.239102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414055.371886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414055.494732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414055.623599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414055.755831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414055.932968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414056.042762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414056.177079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414056.303675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414056.429169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414056.557768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414056.676545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414056.805339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414056.929788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414057.061535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414057.194907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414057.305457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414057.426602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414057.566061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414057.697098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414057.830932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414057.982568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414058.100408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414058.232728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414058.366162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414058.491797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414058.610323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414058.733820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414058.864455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414058.990031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414059.118196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414059.243208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414059.382231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414059.521459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414059.632677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414059.764348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414059.903640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414060.043684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414060.174340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414060.303813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414060.423592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414060.557988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414060.678490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414060.821291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414060.939164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414061.069521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414061.193617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414061.324475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414061.468192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414061.612141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414061.741532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414061.871726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414062.006462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414062.143463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414062.271808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414062.424512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414062.557541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414062.684240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414062.816328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414062.963745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414063.068626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414063.217499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414063.335730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414063.469694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414063.589557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414063.736176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414063.861744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414063.987519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414064.113207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414064.257270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414064.369189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414064.505770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414064.626725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414064.764481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414064.894151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414065.027102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414065.153517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414065.300672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414065.423387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414065.551439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414065.673666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414065.806057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414065.938118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414066.063761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414066.193125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414066.336305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414066.447598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414066.580081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414066.708078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414066.848514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414066.974671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414067.118139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414067.229932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414067.370713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414067.487573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414067.614104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414067.744042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414067.898524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414068.023571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414068.152225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414068.297479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414068.424690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414068.543114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414068.673249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414068.800994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414068.932326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414069.057253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414069.182364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414069.319491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414069.435426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414069.566202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414069.691025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414069.822938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414069.965826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414070.090922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414070.224669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414070.343716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414070.485514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414070.631340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414070.741019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414070.860426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414070.993000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414071.122046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414071.259871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414071.381891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414071.532032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414071.653703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414071.802451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414071.947388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414072.092842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414072.218740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414072.351964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414072.481441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414072.615691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414072.741595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414072.880729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414073.005722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414073.132060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414073.270333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414073.409368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414073.534024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414073.670158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414073.801889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414073.931687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414074.062419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414074.207592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414074.326446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414074.469594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414074.590983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414074.732582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414074.862143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414074.978947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414075.098758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414075.249615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414075.368648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414075.494913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414075.618217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414075.748259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414075.880803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414076.005930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414076.135552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414076.279351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414076.418201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414076.546602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414076.663257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414076.796562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414076.918499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414077.065674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414077.164539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414077.290326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414077.422518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414077.548435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414077.682620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414077.815467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414077.934536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414078.073680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414078.204381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414078.337018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414078.467685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414078.597135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414078.724509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414078.861167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414078.986602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414079.106386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414079.227013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414079.366738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414079.481223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414079.613261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414079.733514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414079.864187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414079.983270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414080.116805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414080.235706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414080.364375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414080.495011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414080.627314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414080.754386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414080.905572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414081.009191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414081.138522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414081.266762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414081.403990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414081.550000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414081.675519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414081.801167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414081.933254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414082.054182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414082.186485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414082.315441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414082.451661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414082.578562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414082.723350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414082.843351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414082.985228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414083.104266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414083.238592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414083.370875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414083.492424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414083.627637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414083.741337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414083.867501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414084.009923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414084.130424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414084.258004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414084.383342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414084.524389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414084.651054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414084.798193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414084.918956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414085.043074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414085.169767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414085.292854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414085.421844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414085.551493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414085.681343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414085.806149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414085.934874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414086.067979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414086.192856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414086.332409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414086.457696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414086.603536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414086.732265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414086.858977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414086.983649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414087.115469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414087.239187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414087.366298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414087.495988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414087.620286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414087.739914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414087.866812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414087.991613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414088.130771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414088.238151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414088.364516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414088.490396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414088.623847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414088.742174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414088.888056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414089.007782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414089.131420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414089.260330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414089.397253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414089.529363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414089.674675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414089.799076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414089.924157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414090.063464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414090.192777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414090.316201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414090.447897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414090.583457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414090.719130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414090.854192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414090.979494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414091.109946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414091.244556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414091.369933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414091.503242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414091.633800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414091.768815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414091.917100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414092.050673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414092.173548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414092.301644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414092.425216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414092.557653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414092.693764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414092.810989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414092.934926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414093.061501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414093.187495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414093.318904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414093.444674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414093.588510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414093.724283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414093.848946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414093.980805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414094.105973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414094.230538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414094.362407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414094.491108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414094.621324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414094.736229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414094.865725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414095.002596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414095.131662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414095.270804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414095.384772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414095.516857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414095.655550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414095.778249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414095.922026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414096.055446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414096.173692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414096.297332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414096.422546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414096.542059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414096.672638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414096.801739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414096.931386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414097.068816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414097.177151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414097.297768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414097.429516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414097.549668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414097.681166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414097.807821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414097.933451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414098.059364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414098.198146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414098.319639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414098.458666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414098.591618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414098.731896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414098.850268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414098.979128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414099.099367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414099.234107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414099.355482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414099.490187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414099.615222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414099.737863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414099.873571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414100.011437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414100.138794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414100.277961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414100.402015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414100.532174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414100.667086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414100.815920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414100.926513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414101.056560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414101.186622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414101.317122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414101.446781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414101.590253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414101.716442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414101.870072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414102.008872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414102.140805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414102.261981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414102.403886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414102.526297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414102.659955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414102.788871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414102.921567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414103.049335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414103.177881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414103.301855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414103.429501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414103.550826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414103.678249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414103.801195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414103.945197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414104.065792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414104.198678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414104.339603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414104.478445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414104.596167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414104.726411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414104.853328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414104.988956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414105.098810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414105.238825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414105.379055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414105.488258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414105.603452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414105.737919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414105.873670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414105.997875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414106.124678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414106.272557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414106.401859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414106.532971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414106.665854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414106.799634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414106.924695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414107.041827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414107.170755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414107.354323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414107.482631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414107.603787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414107.727606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414107.869677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414107.992020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414108.128321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414108.257450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414108.435756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414108.671752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414108.982327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414109.325648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414109.698405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414109.982445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414110.311213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414110.499769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414110.680544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414110.904132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414111.059858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414111.262599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414111.525325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414111.679392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414111.901629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414112.045076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414112.206931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414112.382093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414112.576144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414112.738768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414112.930353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414113.095110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414113.270457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414113.463598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414113.632336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414113.824177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414113.971274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414114.186024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414114.409818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414114.554243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414114.739754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414114.902029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414115.059690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414115.230835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414115.383504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414115.545267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414115.855262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414116.089501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414116.232003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414116.370136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414116.520497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414116.652586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414116.840287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414117.012407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414117.191562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414117.379028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414117.576265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414117.736555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414117.907482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414118.084027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414118.255453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414118.435313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414118.613243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414118.828030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414118.993069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414119.153986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414119.315963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414119.493397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414119.675305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414119.873955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414120.177000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414120.433661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414120.556394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414120.686348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414120.820825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414120.968479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414121.104498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414121.238000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414121.360802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414121.490156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414121.609637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414121.742212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414121.872462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414122.008414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414122.139009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414122.275133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414122.411623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414122.544973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414122.672984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414122.796847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414122.936473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414123.160952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414123.302267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414123.425655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414123.548506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414123.677731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414123.799454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414123.928853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414124.054883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414124.175218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414124.305821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414124.422053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414124.552262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414124.675959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414124.807622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414124.944457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414125.069407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414125.200407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414125.335639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414125.446282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414125.588276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414125.724819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414125.843781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414125.988818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414126.098748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414126.249949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414126.357267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414126.486415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414126.619318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414126.743505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414126.865184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414126.993351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414127.118159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414127.246751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414127.377269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414127.505217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414127.649061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414127.771814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414127.906744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414128.033907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414128.166522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414128.303832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414128.434378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414128.560375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414128.686462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414128.830869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414128.947379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414129.089022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414129.212810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414129.340735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414129.470009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414129.602524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414129.723856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414129.858431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414129.978102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414130.114898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414130.242612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414130.374273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414130.523045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414130.627379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414130.755069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414130.897749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414131.033560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414131.163764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414131.287169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414131.420556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414131.557109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414131.671985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414131.801862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414131.966654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414132.088377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414132.218704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414132.358540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414132.481721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414132.606871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414132.737669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414132.860135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414132.990182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414133.118974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414133.249880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414133.378464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414133.503635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414133.633089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414133.758273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414133.895599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414134.030994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414134.173407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414134.298801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414134.420802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414134.555725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414134.672640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414134.801440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414134.925591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414135.058489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414135.183064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414135.315796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414135.444644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414135.574449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414135.701822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414135.843588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414135.984447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414136.111538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414136.233522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414136.360227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414136.482383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414136.610799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414136.736149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414136.863790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414136.985820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414137.109086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414137.246495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414137.395019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414137.521165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414137.664751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414137.791071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414137.923754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414138.047984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414138.178412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414138.304323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414138.439966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414138.562136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414138.706120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414138.819754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414138.943167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414139.068930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414139.217813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414139.340433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414139.465530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414139.592212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414139.735377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414139.860713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414139.990024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414140.120299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414140.238402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414140.363831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414140.496205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414140.613111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414140.740811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414140.866713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414140.994378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414141.120743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414141.258378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414141.381294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414141.530703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414141.671010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414141.806578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414141.930979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414142.052720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414142.180387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414142.318821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414142.438179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414142.576494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414142.706934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414142.844828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414142.970638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414143.111097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414143.237325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414143.370204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414143.491485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414143.614829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414143.747691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414143.876019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414144.010601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414144.138707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414144.269851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414144.386788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414144.526707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414144.651072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414144.781569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414144.916193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414145.045464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414145.171715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414145.300024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414145.430153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414145.567870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414145.685650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414145.817322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414145.933452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414146.061659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414146.209542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414146.319331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414146.442664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414146.573079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414146.715491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414146.849871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414146.978889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414147.099905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414147.237750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414147.360886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414147.501281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414147.613722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414147.743268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414147.869009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414147.991534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414148.115374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414148.251209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414148.377411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414148.505734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414148.631379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414148.776753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414148.901877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414149.030216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414149.156778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414149.297704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414149.411432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414149.546892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414149.666775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414149.811586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414149.918727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414150.040781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414150.167622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414150.296385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414150.416448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414150.550775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414150.671738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414150.801748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414150.926170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414151.063780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414151.165282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414151.299079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414151.418179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414151.545537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414151.689058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414151.804183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414151.940038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414152.071115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414152.212276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414152.333261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414152.467904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414152.617762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414152.735702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414152.873945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414153.004352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414153.129324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414153.259439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414153.393826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414153.522114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414153.675899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414153.803084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414153.930417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414154.056933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414154.185660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414154.317196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414154.460057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414154.589290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414154.720605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414154.847135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414154.981453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414155.108240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414155.234704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414155.369338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414155.491524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414155.609630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414155.735848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414155.862952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414156.005659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414156.119893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414156.251430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414156.371768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414156.512228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414156.656220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414156.796202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414156.922223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414157.044380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414157.171839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414157.305718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414157.427314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414157.539776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414157.671536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414157.798492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414157.943057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414158.060980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414158.176389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414158.304505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414158.430758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414158.566605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414158.692034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414158.824554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414158.943565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414159.074373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414159.197998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414159.321038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414159.465159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414159.610165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414159.723357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414159.863326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414159.985179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414160.118404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414160.242478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414160.361113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414160.500146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414160.614122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414160.737747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414160.869235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414160.996128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414161.126251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414161.266861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414161.402222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414161.541770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414161.662457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414161.783787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414161.939604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414162.058435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414162.202557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414162.320283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414162.465135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414162.587029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414162.729908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414162.851046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414162.982270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414163.115736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414163.233961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414163.353632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414163.474688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414163.592761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414163.734812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414163.878749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414163.997305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414164.117341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414164.255152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414164.380602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414164.519959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414164.652329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414164.791943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414164.914939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414165.035959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414165.170227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414165.293422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414165.416906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414165.549887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414165.675152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414165.800453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414165.918898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414166.053500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414166.173545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414166.305274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414166.486733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414166.612740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414166.736262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414166.867767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414166.991876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414167.125616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414167.246465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414167.378942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414167.508854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414167.649853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414167.794024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414167.925190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414168.043890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414168.179682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414168.301631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414168.432182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414168.571319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414168.698883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414168.822498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414168.964028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414169.082797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414169.216356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414169.350281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414169.466561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414169.604352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414169.729896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414169.860353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414169.990250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414170.212557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414170.338514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414170.486780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414170.612038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414170.757369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414170.873591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414171.002747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414171.135560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414171.268476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414171.395616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414171.537026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414171.664132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414171.794482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414171.920960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414172.049879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414172.171607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414172.296325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414172.422771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414172.553960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414172.674679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414172.805439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414172.930586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414173.057652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414173.185266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414173.320643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414173.455894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414173.591672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414173.744766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414173.862626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414173.989523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414174.117198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414174.242843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414174.370995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414174.494973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414174.628280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414174.753509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414174.898718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414175.026811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414175.158664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414175.284864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414175.411694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414175.541697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414175.667574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414175.787159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414175.939866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414176.059694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414176.198434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414176.320595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414176.462880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414176.584944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414176.722919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414176.843178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414176.985199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414177.106737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414177.250980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414177.358298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414177.482425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414177.622556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414177.746398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414177.896122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414178.030252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414178.157852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414178.280765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414178.418841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414178.551441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414178.674915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414178.820180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414178.929108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414179.063877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414179.192205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414179.336917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414179.456945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414179.586147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414179.719725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414179.839471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414179.969934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414180.118436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414180.248113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414180.365007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414180.482819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414180.613676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414180.740908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414180.883637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414180.996017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414181.132125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414181.274728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414181.403178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414181.531508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414181.660574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414181.802820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414181.942519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414182.051150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414182.205520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414182.316194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414182.441890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414182.575675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414182.729745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414182.852888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414182.981717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414183.116009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414183.239945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414183.362152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414183.497535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414183.626944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414183.765325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414183.901093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414184.041072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414184.159505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414184.297750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414184.420052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414184.562470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414184.672971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414184.793591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414184.932877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414185.068469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414185.190245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414185.322013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414185.446163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414185.596874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414185.720788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414185.852581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414185.976243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414186.105355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414186.292668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414186.507200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414186.653881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414186.796214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414186.925059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414187.069038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414187.178561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414187.336294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414187.437506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414187.570131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414187.695253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414187.818696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414187.949932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414188.088392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414188.222882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414188.357235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414188.484736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414188.620558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414188.743486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414188.873079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414189.005734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414189.148609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414189.282627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414189.418098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414189.545748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414189.667155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414189.785290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414189.916903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414190.041513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414190.166874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414190.294568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414190.421756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414190.548135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414190.690162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414190.797188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414190.926734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414191.055189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414191.189071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414191.325115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414191.442595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414191.573672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414191.717867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414191.857071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414191.992082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414192.133408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414192.250646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414192.395269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414192.538330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414192.665126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414192.791385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414192.918899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414193.049865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414193.173188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414193.301450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414193.437551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414193.569820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414193.695796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414193.832253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414193.968083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414194.090183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414194.226964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414194.350515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414194.473112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414194.618641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414194.725478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414194.862748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414194.986512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414195.113851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414195.236206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414195.367276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414195.502073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414195.635965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414195.753686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414195.903304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414196.023266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414196.158077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414196.288183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414196.420787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414196.537704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414196.674663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414196.800939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414196.926460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414197.051110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414197.183056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414197.308244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414197.441136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414197.580798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414197.712071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414197.841937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414197.966074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414198.101994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414198.228183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414198.347945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414198.497826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414198.611476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414198.742577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414198.865960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414198.994765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414199.134588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414199.273799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414199.417597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414199.547773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414199.677342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414199.797847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414199.942063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414200.076590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414200.191653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414200.338468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414200.444343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414200.578755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414200.701206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414200.838227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414200.964160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414201.105882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414201.223892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414201.373865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414201.482201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414201.614779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414201.741093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414201.869374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414202.009940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414202.130425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414202.261848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414202.397002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414202.528685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414202.654386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414202.784713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414202.910619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414203.059265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414203.173533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414203.299233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414203.418951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414203.549307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414203.698161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414203.804872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414203.952931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414204.062245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414204.209169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414204.334084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414204.451082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414204.610970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414204.735122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414204.859022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414204.984630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414205.104788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414205.242149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414205.368024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414205.495305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414205.617288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414205.745604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414205.877233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414206.007073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414206.148135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414206.276212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414206.414263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414206.562228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414206.664276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414206.816808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414206.926218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414207.060515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414207.189621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414207.335561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414207.447142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414207.574892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414207.722818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414207.856124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414207.976125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414208.110444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414208.233542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414208.365517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414208.494057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414208.614113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414208.740310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414208.865222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414208.991676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414209.138057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414209.253892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414209.378742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414209.516247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414209.652006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414209.763111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414209.911119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414210.037782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414210.170351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414210.296118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414210.424489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414210.545952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414210.672166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414210.801307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414210.928947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414211.045273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414211.195509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414211.304898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414211.441611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414211.561435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414211.706091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414211.839247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414211.972891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414212.110189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414212.237318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414212.359700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414212.492080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414212.617719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414212.745348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414212.887228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414213.019145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414213.147673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414213.274480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414213.414812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414213.546085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414213.677558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414213.798887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414213.921261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414214.048991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414214.185102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414214.318163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414214.427976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414214.556687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414214.669053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414214.816394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414214.926415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414215.047822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414215.173485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414215.305540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414215.430481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414215.562191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414215.689509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414215.818293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414215.952766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414216.109423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414216.233226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414216.362457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414216.486112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414216.614703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414216.743963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414216.867823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414217.005766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414217.126696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414217.254243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414217.380547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414217.518790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414217.649982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414217.780318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414217.910869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414218.043104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414218.187964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414218.307454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414218.421046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414218.545162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414218.670823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414218.792540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414218.922508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414219.048199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414219.176024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414219.317082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414219.455224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414219.585884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414219.696735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414219.840482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414219.981779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414220.102765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414220.250940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414220.363356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414220.488955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414220.613013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414220.742261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414220.874321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414221.002218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414221.130105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414221.263549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414221.399838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414221.528367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414221.648744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414221.793881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414221.927211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414222.086838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414222.197878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414222.336071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414222.477614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414222.607960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414222.732507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414222.857824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414222.985544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414223.108271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414223.235154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414223.374557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414223.486782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414223.609714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414223.741231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414223.877242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414224.010223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414224.143839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414224.277411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414224.418455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414224.543831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414224.673592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414224.793988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414224.932622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414225.048646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414225.177340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414225.297816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414225.423055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414225.552181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414225.680609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414225.820650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414225.942505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414226.090120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414226.224511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414226.340803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414226.499378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414226.661821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414226.795723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414226.928320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414227.047151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414227.171676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414227.297909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414227.422603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414227.549137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414227.675518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414227.823236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414227.952698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414228.064294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414228.198211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414228.353030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414228.454338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414228.634766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414228.884651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414229.202471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414229.673719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414230.001845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414230.385770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414230.584828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414230.799722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414230.999135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414231.191523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414231.331903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414231.506234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414231.704882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414231.858231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414232.053595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414232.208274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414232.364995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414232.538725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414232.711636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414232.875818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414233.045489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414233.234611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414233.388721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414233.555379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414233.767906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414233.906317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414234.113020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414234.289686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414234.462399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414234.678886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414234.839507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414235.013255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414235.151241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414235.282772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414235.464487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414235.647636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414235.908120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414236.117815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414236.301091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414236.429284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414236.565855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414236.710885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414236.866256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414237.032702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414237.212499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414237.371187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414237.534529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414237.738345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414237.903332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414238.062913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414238.230587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414238.414229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414238.590829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414238.744736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414238.904067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414239.106990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414239.255460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414239.427796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414239.606712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414239.778152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414239.954831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414240.317916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414240.479972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414240.635657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414240.759291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414240.896423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414241.023889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414241.161544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414241.288792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414241.421601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414241.546716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414241.676477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414241.803339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414241.960459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414242.087667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414242.229366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414242.349516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414242.487689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414242.625216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414242.737983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414242.857565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414242.987957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414243.124549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414243.359494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414243.486889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414243.611503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414243.752206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414243.857736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414243.978543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414244.106628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414244.235073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414244.357089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414244.473411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414244.614483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414244.734695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414244.862473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414244.986120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414245.119137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414245.244277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414245.386585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414245.509078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414245.650494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414245.773013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414245.898735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414246.031997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414246.195394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414246.307128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414246.437367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414246.579064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414246.703254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414246.829043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414246.981057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414247.097585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414247.236767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414247.356883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414247.483060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414247.609353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414247.742027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414247.875736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414248.014482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414248.134506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414248.280145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414248.427702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414248.556025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414248.680154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414248.805280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414248.937208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414249.074078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414249.216000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414249.355443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414249.467418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414249.597216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414249.724149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414249.854827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414249.965113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414250.098015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414250.231828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414250.358325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414250.479781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414250.612956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414250.735023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414250.858141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414250.985804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414251.113483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414251.240278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414251.379303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414251.503753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414251.636189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414251.805611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414251.929059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414252.051462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414252.176420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414252.303791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414252.432120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414252.563360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414252.677606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414252.813776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414252.961989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414253.087661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414253.212385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414253.343020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414253.472307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414253.592215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414253.724610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414253.852840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414253.979939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414254.103303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414254.234134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414254.359215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414254.482389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414254.601347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414254.730665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414254.853900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414254.985871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414255.112887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414255.232803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414255.350367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414255.487129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414255.610160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414255.741926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414255.857463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414255.995531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414256.112902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414256.236720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414256.366251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414256.499036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414256.618433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414256.744861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414256.876884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414257.008104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414257.139483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414257.292927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414257.415207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414257.543783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414257.664255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414257.798741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414257.911151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414258.042257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414258.167954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414258.300089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414258.431023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414258.556368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414258.691640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414258.835693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414258.963638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414259.108751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414259.237734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414259.362966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414259.495726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414259.625446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414259.746031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414259.879959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414260.021719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414260.150195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414260.283072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414260.417417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414260.554507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414260.668320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414260.803284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414260.922084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414261.077370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414261.186427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414261.313121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414261.456307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414261.572564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414261.706646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414261.840930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414261.977163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414262.107747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414262.229148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414262.358715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414262.492006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414262.614686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414262.753870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414262.880557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414263.023669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414263.150493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414263.285719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414263.416633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414263.546901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414263.669549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414263.796105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414263.939981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414264.045950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414264.168353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414264.300027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414264.421560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414264.565839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414264.679304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414264.801648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414264.927173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414265.065719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414265.187506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414265.333638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414265.463002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414265.579681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414265.715837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414265.858472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414265.977368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414266.108839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414266.239870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414266.360931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414266.485361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414266.609476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414266.740036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414266.861876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414266.974953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414267.120982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414267.226158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414267.364618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414267.484666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414267.611973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414267.733805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414267.862684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414267.985597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414268.111055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414268.236276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414268.365097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414268.507551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414268.627953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414268.767508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414268.911971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414269.040611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414269.155609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414269.283524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414269.436989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414269.549559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414269.661808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414269.796409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414269.922855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414270.042764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414270.176500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414270.299725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414270.429119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414270.550702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414270.680065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414270.802742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414270.949678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414271.062552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414271.207380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414271.333021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414271.471189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414271.590026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414271.722618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414271.861334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414271.982280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414272.115454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414272.255108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414272.362659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414272.490746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414272.613082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414272.747088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414272.869982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414273.009755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414273.129218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414273.275114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414273.403009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414273.560766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414273.661226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414273.813071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414273.930001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414274.053625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414274.172808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414274.305477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414274.444490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414274.569073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414274.690720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414274.834301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414274.957227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414275.092511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414275.220197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414275.352770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414275.498865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414275.611558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414275.732304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414275.878485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414276.001245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414276.117266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414276.238512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414276.378134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414276.502869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414276.634861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414276.772680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414276.902531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414277.036786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414277.164922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414277.282835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414277.434645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414277.549071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414277.673575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414277.803742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414277.939666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414278.062575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414278.190418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414278.320112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414278.462719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414278.594028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414278.725630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414278.850049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414278.982359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414279.101340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414279.240464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414279.354842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414279.476302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414279.611631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414279.745198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414279.888901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414280.023564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414280.166122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414280.298332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414280.413275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414280.544399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414280.662564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414280.796309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414280.914472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414281.046737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414281.172866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414281.316590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414281.436337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414281.576380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414281.691550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414281.835639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414281.999915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414282.130643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414282.277266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414282.396362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414282.534827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414282.670962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414282.802206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414282.917576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414283.041302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414283.177645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414283.294135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414283.427866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414283.552523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414283.685623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414283.818348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414283.967457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414284.110734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414284.217502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414284.343542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414284.478200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414284.603625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414284.726375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414284.844972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414284.976949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414285.097656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414285.225405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414285.358847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414285.486173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414285.613305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414285.739277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414285.874312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414286.009330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414286.131786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414286.267632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414286.397975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414286.549741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414286.659500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414286.790797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414286.913226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414287.042909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414287.183956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414287.297232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414287.417216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414287.539636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414287.683963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414287.796424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414287.938668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414288.104852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414288.251339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414288.399917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414288.519038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414288.661956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414288.786626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414288.913156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414289.039380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414289.168977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414289.297876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414289.420462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414289.545491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414289.669943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414289.798781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414289.923437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414290.047629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414290.219994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414290.382976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414290.514719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414290.648467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414290.788542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414290.907449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414291.040415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414291.181730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414291.298561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414291.432511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414291.557915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414291.676904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414291.799721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414291.924012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414292.062594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414292.187226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414292.320446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414292.451351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414292.586986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414292.729592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414292.861529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414292.985980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414293.132948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414293.250081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414293.390023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414293.521690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414293.648264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414293.777348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414293.918212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414294.041281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414294.170794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414294.310636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414294.422644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414294.567827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414294.690366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414294.810995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414294.941289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414295.084432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414295.215913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414295.332896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414295.463628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414295.591072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414295.730612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414295.873670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414296.009659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414296.132427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414296.262697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414296.397302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414296.536122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414296.673776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414296.799021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414296.925261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414297.054168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414297.178050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414297.323938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414297.451648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414297.577319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414297.718160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414297.848698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414297.973448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414298.122881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414298.228592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414298.369656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414298.482494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414298.612197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414298.737842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414298.894287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414299.007254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414299.142344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414299.283051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414299.417662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414299.540236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414299.669989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414299.786414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414299.918133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414300.045473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414300.176322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414300.299967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414300.444995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414300.553195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414300.693477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414300.818280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414300.948888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414301.085552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414301.226247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414301.345793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414301.489694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414301.603357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414301.737807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414301.867252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414301.994450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414302.131145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414302.268637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414302.395365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414302.543870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414302.663470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414302.791010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414302.918683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414303.046318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414303.171929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414303.304243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414303.428020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414303.576067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414303.708403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414303.839025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414303.980156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414304.124359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414304.234104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414304.360136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414304.479415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414304.607797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414304.743360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414304.864914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414305.002474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414305.146751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414305.270529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414305.419052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414305.556129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414305.670131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414305.796184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414305.920248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414306.042992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414306.169518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414306.289454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414306.417867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414306.544221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414306.688121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414306.794521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414306.925826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414307.045945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414307.167977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414307.293150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414307.428129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414307.542824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414307.670100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414307.811828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414307.924066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414308.043074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414308.174870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414308.302302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414308.433357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414308.560080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414308.691000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414308.820849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414308.945011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414309.094709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414309.230302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414309.350798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414309.484169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414309.611340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414309.742175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414309.870761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414310.006915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414310.134569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414310.274371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414310.404722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414310.540770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414310.670370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414310.795436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414310.918685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414311.049802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414311.190234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414311.315905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414311.441659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414311.568109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414311.702522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414311.850613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414311.992485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414312.134715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414312.252159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414312.394720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414312.515895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414312.673277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414312.788308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414312.914157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414313.034527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414313.169454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414313.300974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414313.439781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414313.563835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414313.715252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414313.848576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414313.984711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414314.099891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414314.226590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414314.358725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414314.482138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414314.605268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414314.733130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414314.861142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414314.989777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414315.122803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414315.249060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414315.374915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414315.523321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414315.661423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414315.796798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414315.916204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414316.047586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414316.177438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414316.320041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414316.437509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414316.584594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414316.711244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414316.847820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414316.963520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414317.115145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414317.226448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414317.357524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414317.483318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414317.615144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414317.740772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414317.867028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414317.990787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414318.125511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414318.252294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414318.395180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414318.521828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414318.669374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414318.794741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414318.917286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414319.042415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414319.163268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414319.290502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414319.420010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414319.544487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414319.686611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414319.797990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414319.935264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414320.060676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414320.181650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414320.308510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414320.434471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414320.562543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414320.693364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414320.834897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414320.968110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414321.087566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414321.232756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414321.342699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414321.497550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414321.610546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414321.732865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414321.866377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414322.000868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414322.124382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414322.264603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414322.397364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414322.530561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414322.656259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414322.790192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414322.901057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414323.043366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414323.166389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414323.291977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414323.426695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414323.551826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414323.675562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414323.800585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414323.944060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414324.068900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414324.194358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414324.343279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414324.458109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414324.588148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414324.718723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414324.836386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414324.981218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414325.113613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414325.228650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414325.366719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414325.478679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414325.607190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414325.730481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414325.863905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414325.989313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414326.126341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414326.266434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414326.399911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414326.532796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414326.671077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414326.784992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414326.918714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414327.045943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414327.164939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414327.300412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414327.434846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414327.554647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414327.684301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414327.813638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414327.941634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414328.072763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414328.212626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414328.340911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414328.476343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414328.594639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414328.731781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414328.856588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414328.986659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414329.103616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414329.239212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414329.361418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414329.498925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414329.625792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414329.756665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414329.899454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414330.038912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414330.168396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414330.290578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414330.416037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414330.564304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414330.672349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414330.809765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414330.940654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414331.054643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414331.185141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414331.338451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414331.451335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414331.584719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414331.712406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414331.843610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414331.973986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414332.113928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414332.237737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414332.374849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414332.492563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414332.649516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414332.759205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414332.880770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414333.021084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414333.168498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414333.276189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414333.419426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414333.536678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414333.678467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414333.791446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414333.923310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414334.050435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414334.199816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414334.324854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414334.459098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414334.593143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414334.721763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414334.855238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414334.975511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414335.100168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414335.227996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414335.358897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414335.480886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414335.605256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414335.728509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414335.858610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414335.976624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414336.099159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414336.233448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414336.367914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414336.493496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414336.613066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414336.739081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414336.861815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414336.991294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414337.117094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414337.245738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414337.373334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414337.521000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414337.648315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414337.781979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414337.908798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414338.051468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414338.184074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414338.305238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414338.434181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414338.561986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414338.693041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414338.835007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414338.971594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414339.089746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414339.223000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414339.360597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414339.484096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414339.607484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414339.731246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414339.871405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414339.990982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414340.125839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414340.256642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414340.419021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414340.523413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414340.660211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414340.788555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414340.913220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414341.038803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414341.171651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414341.295440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414341.419257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414341.550407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414341.673016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414341.798389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414341.943912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414342.089310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414342.235493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414342.347479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414342.472077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414342.600762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414342.722569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414342.853472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414342.980264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414343.106435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414343.235801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414343.362280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414343.498484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414343.626354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414343.772801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414343.904583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414344.033693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414344.154339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414344.287906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414344.424580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414344.546435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414344.684133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414344.799447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414344.923829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414345.059349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414345.188710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414345.311323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414345.448181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414345.583779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414345.711391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414345.871238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414345.986946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414346.108171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414346.247446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414346.366310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414346.487157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414346.625795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414346.815435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414346.934918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414347.059053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414347.208066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414347.336775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414347.466583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414347.591535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414347.712099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414347.873045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414347.990237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414348.111191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414348.233957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414348.369604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414348.488824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414348.610830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414348.743185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414348.893145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414349.017534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414349.147569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414349.328057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414349.589472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414349.926964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414350.201019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414350.543335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414350.763120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414351.122849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414351.366778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414351.569518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414351.791005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414351.987340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414352.145913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414352.370616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414352.546553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414352.742008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414352.912961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414353.078711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414353.233259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414353.426398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414353.606600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414353.790262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414353.956844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414354.129485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414354.271736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414354.448537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414354.662178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414354.833689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414354.975524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414355.137786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414355.294724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414355.527182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414355.695079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414355.937131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414356.065533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414356.255415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414356.396592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414356.558814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414356.747739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414356.936303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414357.247216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414357.410195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414357.538925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414357.675179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414357.798604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414357.925360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414358.057342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414358.177555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414358.309320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414358.607996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414358.795947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414358.976475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414359.131556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414359.300112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414359.486293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414359.665416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414359.807002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414359.987642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414360.172451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414360.352537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414360.545962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414360.687378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414360.874674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414361.057933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414361.228415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414361.424102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414361.570844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414361.744948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414361.980251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414362.253340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414362.500827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414362.664876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414362.810800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414362.928352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414363.082991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414363.210186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414363.351580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414364.365095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414364.533574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414364.701312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414364.861933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414365.003730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414365.230990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414365.376017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414365.531781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414365.638309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414365.772948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414365.917026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414366.042918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414366.162011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414366.296375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414366.416124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414366.551208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414366.671360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414366.807698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414366.936979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414367.067893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414367.204394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414367.312477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414367.444935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414367.590287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414367.710690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414367.837983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414367.976136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414368.103290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414368.230430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414368.356380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414368.925480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414369.076542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414369.239963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414369.366447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414369.494443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414369.641134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414369.757928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414369.901889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414370.022551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414370.153642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414370.300399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414370.434079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414370.567891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414370.686655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414370.842173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414370.956501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414371.101065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414371.224315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414371.356226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414371.486500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414371.622923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414371.747973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414371.908625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414372.041218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414372.171823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414372.294760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414372.421357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414372.545414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414372.679511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414372.800909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414372.922192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414373.050808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414373.207336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414373.334910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414373.463248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414373.598231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414373.744317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414373.863571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414373.984304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414374.105566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414374.234431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414374.361550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414374.487102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414374.616344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414374.740805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414374.876069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414375.022351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414375.146559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414375.287321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414375.407560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414375.544859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414375.670284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414375.802387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414375.922600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414376.037101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414376.174994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414376.304896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414376.443081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414376.568395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414376.700498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414376.834757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414376.963917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414377.087292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414377.218997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414377.353762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414377.483677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414377.612257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414377.730763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414377.859033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414377.983264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414378.111161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414378.231309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414378.362094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414378.496065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414378.608445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414378.734066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414378.864057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414379.001131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414379.138493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414379.249998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414379.383688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414379.518983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414379.658866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414379.784391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414379.920333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414380.049753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414380.172423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414380.311460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414380.432950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414380.556664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414380.682857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414380.803176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414380.944559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414381.085233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414381.222165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414381.344645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414381.477767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414381.602578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414381.731503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414381.856299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414382.001124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414382.109575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414382.237226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414382.370181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414382.502270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414382.617963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414382.762606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414382.878886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414383.017998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414383.152216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414383.285366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414383.406667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414383.537493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414383.665805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414383.811010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414383.949044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414384.080884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414384.202977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414384.338536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414384.466410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414384.589058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414384.726571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414384.852682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414384.970283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414385.111832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414385.237018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414385.367643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414385.496630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414385.622405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414385.750000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414385.920713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414386.022206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414386.158486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414386.284478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414386.413884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414386.541364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414386.666101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414386.790521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414386.920111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414387.044235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414387.169152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414387.296325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414387.433720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414387.574457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414387.694640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414387.820263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414387.969661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414388.099332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414388.222543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414388.349051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414388.479126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414388.604084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414388.733516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414388.871545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414388.978502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414389.108899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414389.232632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414389.358776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414389.479980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414389.605807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414389.731762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414389.850755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414389.982105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414390.122573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414390.249617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414390.369890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414390.504593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414390.641222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414390.775531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414390.914151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414391.048282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414391.170180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414391.296728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414391.417844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414391.548113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414391.667629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414391.799932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414391.929471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414392.061373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414392.203513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414392.330217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414392.459815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414392.591662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414392.726669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414392.848727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414392.968091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414393.098573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414393.221222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414393.374019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414393.481484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414393.604870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414393.746429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414393.869548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414393.998269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414394.132079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414394.269263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414394.406780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414394.532835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414394.658936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414394.784889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414394.924393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414395.032277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414395.166401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414395.292094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414395.426128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414395.562263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414395.688506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414395.827916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414395.971537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414396.088169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414396.219090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414396.356538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414396.479241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414396.607738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414396.726670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414396.850788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414396.977993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414397.107284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414397.235113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414397.357953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414397.482906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414397.611774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414397.747371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414397.877586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414398.021992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414398.144608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414398.278580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414398.413659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414398.543178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414398.661460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414398.787889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414398.912573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414399.045002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414399.164572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414399.300080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414399.419245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414399.545489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414399.673329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414399.812381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414399.958239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414400.084977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414400.227214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414400.368282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414400.480270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414400.611716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414400.734834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414400.862584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414400.989882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414401.133254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414401.263112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414401.400077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414401.527190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414401.657512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414401.793426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414401.951718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414402.079109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414402.204343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414402.338994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414402.469875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414402.599709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414402.727912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414402.861837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414402.980937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414403.105094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414403.229571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414403.372513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414403.482036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414403.611552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414403.740265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414403.884588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414404.024036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414404.153534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414404.287367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414404.411282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414404.534031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414404.681652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414404.786106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414404.904170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414405.029592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414405.155380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414405.301052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414405.407727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414405.540442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414405.666822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414405.790240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414405.916102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414406.043627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414406.176912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414406.311372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414406.425690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414406.562424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414406.691743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414406.818769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414406.947775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414407.086791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414407.210739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414407.348867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414407.468847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414407.590705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414407.718842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414407.873402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414407.980622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414408.111235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414408.236316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414408.370278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414408.495693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414408.641507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414408.768075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414408.917128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414409.030418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414409.159963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414409.293159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414409.432944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414409.562870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414409.680669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414409.816171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414409.957961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414410.092025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414410.218672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414410.343498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414410.478068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414410.597936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414410.731107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414410.871628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414411.100948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414411.245336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414411.368840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414411.490666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414411.632646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414411.758622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414411.902327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414412.039752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414412.165783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414412.292150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414412.434075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414412.560469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414412.676754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414412.800155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414412.930573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414413.058405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414413.190468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414413.325804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414413.476174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414413.612655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414413.745809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414413.855905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414413.986211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414414.123867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414414.247991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414414.391175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414414.521095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414414.657727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414414.794002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414414.920193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414415.043446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414415.172211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414415.296925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414415.422418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414415.557659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414415.681283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414415.808066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414415.978306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414416.107732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414416.250907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414416.367760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414416.494179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414416.628906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414416.760576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414416.897004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414417.022550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414417.147579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414417.274720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414417.401637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414417.534817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414417.660761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414417.789068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414417.912549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414418.036295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414418.174447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414418.308581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414418.418240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414418.542957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414418.668298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414418.811417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414418.926641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414419.059177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414419.188288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414419.306955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414419.449537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414419.583121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414419.708362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414419.846422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414419.971712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414420.093125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414420.228249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414420.355721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414420.477864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414420.603472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414420.729599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414420.851431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414420.982042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414421.117445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414421.250728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414421.392641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414421.507537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414421.657266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414421.791191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414421.922926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414422.045455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414422.172082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414422.300005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414422.437192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414422.592270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414422.713035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414422.835287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414422.958631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414423.096788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414423.224619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414423.349023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414423.478957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414423.611714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414423.736503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414423.867872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414424.007371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414424.146852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414424.278244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414424.402997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414424.529176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414424.661729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414424.793265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414424.921112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414425.049504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414425.190887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414425.301567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414425.456956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414425.578282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414425.712717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414425.867043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414425.978842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414426.102094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414426.227998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414426.350483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414426.484366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414426.614156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414426.746579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414426.877661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414427.019582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414427.144857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414427.281371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414427.403194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414427.536461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414427.664549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414427.789242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414427.932491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414428.049293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414428.185013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414428.310509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414428.443159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414428.566478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414428.708995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414428.834480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414428.975922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414429.101839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414429.225931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414429.357555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414429.481926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414429.608593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414429.746436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414429.863287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414429.996199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414430.149314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414430.271193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414430.390823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414430.528309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414430.655442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414430.793328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414430.910829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414431.037318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414431.169990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414431.290313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414431.423059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414431.546726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414431.676172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414431.808853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414431.976844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414432.102095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414432.230566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414432.344111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414432.496374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414432.620543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414432.737301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414432.855264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414432.985040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414433.110433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414433.242857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414433.368128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414433.497188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414433.623799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414433.747096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414433.893025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414434.045149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414434.165873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414434.290353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414434.416984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414434.550804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414434.672091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414434.805250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414434.931294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414435.067219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414435.192785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414435.326174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414435.457299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414435.589700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414435.716836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414435.850969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414435.969763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414436.096347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414436.227103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414436.355708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414436.493965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414436.617179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414436.745020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414436.890384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414437.003163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414437.145717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414437.274824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414437.408373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414437.533101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414437.667444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414437.788627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414437.918337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414438.042780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414438.170719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414438.296432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414438.446984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414438.550982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414438.691103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414438.831343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414438.961658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414439.094083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414439.216910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414439.351413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414439.479350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414439.620739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414439.732122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414439.872543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414439.992442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414440.122895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414440.265193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414440.390869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414440.537120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414440.658988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414440.787138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414440.917538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414441.058842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414441.164007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414441.291584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414441.415810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414441.545078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414441.673421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414441.828483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414441.959679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414442.098073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414442.207057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414442.339315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414442.486565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414442.621849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414442.750420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414442.888394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414443.025134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414443.154835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414443.270804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414443.402930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414443.529717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414443.644522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414443.775135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414443.904837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414444.033115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414444.153182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414444.283778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414444.414328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414444.536187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414444.669306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414444.806373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414444.910512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414445.040649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414445.162421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414445.291560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414445.417683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414445.530071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414445.664600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414445.784117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414445.916855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414446.037201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414446.168042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414446.291534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414446.422519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414446.556455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414446.684005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414446.814962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414446.952722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414447.079645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414447.218853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414447.350068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414447.472332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414447.588595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414447.720497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414447.846274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414447.971823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414448.100433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414448.246277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414448.349212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414448.499750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414448.611294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414448.739316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414448.869219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414448.992933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414449.122837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414449.268300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414449.389909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414449.515780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414449.658477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414449.781913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414449.904185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414450.037750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414450.156495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414450.290326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414450.406562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414450.545983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414450.664398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414450.801316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414450.918933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414451.045965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414451.172577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414451.319097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414451.425923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414451.560151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414451.681098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414451.816856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414451.942410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414452.084232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414452.205123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414452.333243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414452.470093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414452.604795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414452.728368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414452.855868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414452.986797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414453.108067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414453.236078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414453.402582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414453.525289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414453.664940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414453.776942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414453.902602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414454.043518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414454.166924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414454.285967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414454.430470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414454.540167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414454.666068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414454.815197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414454.931904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414455.072816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414455.198476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414455.330628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414455.478757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414455.599209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414455.726840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414455.847436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414455.994426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414456.102068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414456.236006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414456.372966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414456.482306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414456.610682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414456.738046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414456.874156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414457.024908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414457.150980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414457.282018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414457.411086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414457.538205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414457.664111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414457.814063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414457.923385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414458.057094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414458.183083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414458.321883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414458.449039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414458.585816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414458.708344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414458.838429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414458.970462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414459.103180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414459.224956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414459.352841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414459.478167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414459.605057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414459.742604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414459.870285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414460.010197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414460.151180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414460.275404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414460.414495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414460.526676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414460.667743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414460.786694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414460.918586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414461.046827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414461.183713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414461.323760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414461.471710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414461.581495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414461.718045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414461.852073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414462.010910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414462.139138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414462.273372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414462.393473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414462.535761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414462.659273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414462.786587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414462.903374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414463.033844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414463.158911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414463.292473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414463.416571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414463.559455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414463.684359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414463.811240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414463.948533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414464.079735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414464.214409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414464.345189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414464.491748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414464.603278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414464.721698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414464.859366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414464.976534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414465.105792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414465.228148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414465.356007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414465.475633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414465.605677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414465.727079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414465.860252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414465.996969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414466.113579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414466.238958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414466.363528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414466.487072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414466.627214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414466.759633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414466.880229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414467.008498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414467.170193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414467.330855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414467.458659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414467.592242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414467.723304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414467.852930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414467.979520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414468.100151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414468.230144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414468.355877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414468.473732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414468.595159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414468.726970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414468.844310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414468.995172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414469.100931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414469.242692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414469.383537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414469.499465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414469.627446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414469.747565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414469.893683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414470.029958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414470.159577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414470.295534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414470.407237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414470.551520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414470.681576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414470.790908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414470.931116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414471.046583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414471.165257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414471.300769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414471.432073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414471.561355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414471.683942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414471.828424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414471.957418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414472.090300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414472.219809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414472.349155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414472.472238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414472.612630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414472.731873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414472.859643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414472.974824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414473.106412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414473.234395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414473.353430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414473.491138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414473.627018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414473.733053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414473.864657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414473.994863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414474.119421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414474.262034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414474.397339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414474.529834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414474.648923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414474.774392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414474.906673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414475.028152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414475.159450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414475.288901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414475.434190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414475.548972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414475.669060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414475.813228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414475.961440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414476.079108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414476.240954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414476.346189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414476.472990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414476.602164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414476.736480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414476.856498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414476.980768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414477.113586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414477.253254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414477.371862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414477.533287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414477.657319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414477.786873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414477.903636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414478.032732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414478.159737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414478.290496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414478.415085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414478.551732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414478.674688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414478.795622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414478.922451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414479.056498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414479.170037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414479.303801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414479.426944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414479.567881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414479.713833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414479.840385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414479.975234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414480.105951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414480.229757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414480.357084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414480.485032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414480.620122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414480.748149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414480.894953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414481.015795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414481.149489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414481.276383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414481.402781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414481.529240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414481.655343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414481.783465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414481.919590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414482.055198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414482.164454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414482.304829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414482.426691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414482.554038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414482.678390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414482.810198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414482.931947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414483.059730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414483.202390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414483.342768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414483.469026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414483.596830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414483.759817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414483.859657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414483.996474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414484.123517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414484.252937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414484.388876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414484.537095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414484.653561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414484.784436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414484.907724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414485.049442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414485.166879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414485.287578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414485.418808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414485.561245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414485.681425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414485.805426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414485.951396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414486.076649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414486.221633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414486.453515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414486.626878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414486.746743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414486.870120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414487.009596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414487.140739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414487.261164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414487.399510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414487.529932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414487.654313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414487.790486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414487.901967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414488.037241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414488.163464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414488.292151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414488.409412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414488.530352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414488.663549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414488.793236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414488.931640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414489.046499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414489.169371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414489.295770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414489.418823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414489.546857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414489.679287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414489.818712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414489.934060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414490.066577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414490.213813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414490.344811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414490.487551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414490.602673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414490.734895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414490.854093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414490.979005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414491.131767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414491.232680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414491.358556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414491.487075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414491.621609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414491.747261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414491.882584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414492.031832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414492.165780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414492.280349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414492.416705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414492.550643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414492.733532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414493.048579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414493.369309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414493.763715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414494.042420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414494.512684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414494.683319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414494.928430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414495.105760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414495.305928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414495.482419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414495.665819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414495.851685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414495.980000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414496.144479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414496.300074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414496.471285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414496.641773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414496.802809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414496.971727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414497.141064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414497.306282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414497.471880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414497.639550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414497.823669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414497.979579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414498.144307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414498.332750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414498.479270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414498.681906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414498.871761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414499.044832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414499.221294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414499.365281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414499.519935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414499.696208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414499.851024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414500.030137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414500.299054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414500.547375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414500.691347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414500.832003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414500.983580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414501.106421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414501.282233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414501.450551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414501.635085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414501.798797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414501.948865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414502.112893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414502.319371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414502.479546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414502.661033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414502.806645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414502.971232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414503.134678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414503.304698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414503.480773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414503.646764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414503.816907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414503.966577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414504.119930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414504.302167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414504.462079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414504.688604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414505.055440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414505.174673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414505.306649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414505.429136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414505.554506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414505.689894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414505.834930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414505.966345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414506.112389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414506.227182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414506.341422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414506.473176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414506.603754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414506.726370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414506.860153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414506.999510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414507.116568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414507.244857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414507.374027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414507.514125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414507.653824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414507.919621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414508.038839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414508.165213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414508.289154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414508.431569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414508.536303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414508.675805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414508.796066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414508.923358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414509.050806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414509.186857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414509.330485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414509.458989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414509.583910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414509.706123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414509.827297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414509.956921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414510.086235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414510.224469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414510.339441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414510.470231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414510.597811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414510.724125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414510.839488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414510.980789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414511.109613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414511.248312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414511.371157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414511.524116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414511.644129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414511.775158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414511.914048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414512.047541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414512.168277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414512.309735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414512.425888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414512.580075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414512.698535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414512.840822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414512.974319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414513.115145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414513.235185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414513.355138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414513.479700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414513.606887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414513.728670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414513.857450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414513.972935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414514.111192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414514.230246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414514.354896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414514.470143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414514.603751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414514.726745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414514.850507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414514.971816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414515.105700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414515.235353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414515.373561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414515.475019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414515.609913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414515.730637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414515.866486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414515.984042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414516.114377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414516.237548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414516.372062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414516.510188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414516.646631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414516.810263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414516.946192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414517.058361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414517.190201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414517.330691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414517.454838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414517.595196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414517.725962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414517.852906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414517.995559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414518.106274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414518.234559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414518.355405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414518.491532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414518.626284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414518.760794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414518.897913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414519.032559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414519.159744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414519.291630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414519.411874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414519.557528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414519.663517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414519.789464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414519.951159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414520.097995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414520.211435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414520.350264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414520.463256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414520.601897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414520.714162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414520.842992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414520.968210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414521.102222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414521.232149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414521.357733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414521.496423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414521.627344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414521.732554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414521.894459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414522.035582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414522.171311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414522.293884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414522.427965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414522.556626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414522.695216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414522.829048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414522.955978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414523.092484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414523.228795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414523.346118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414523.494392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414523.606464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414523.732613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414523.869904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414524.025177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414524.153409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414524.278102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414524.397168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414524.524065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414524.665147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414524.791952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414524.917803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414525.054644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414525.173687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414525.313143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414525.434687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414525.566811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414525.707539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414525.824843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414525.971220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414526.111647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414526.234393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414526.361501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414526.493550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414526.643096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414526.765847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414526.892741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414527.031292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414527.159414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414527.286560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414527.416271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414527.536444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414527.677477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414527.796614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414527.936038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414528.059809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414528.200134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414528.329508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414528.459348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414528.589967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414528.725857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414528.863001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414528.978615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414529.104057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414529.227836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414529.347743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414529.474896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414529.601968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414529.746808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414529.858612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414529.982466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414530.107361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414530.249092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414530.391385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414530.526838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414530.650497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414530.781544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414530.904833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414531.040519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414531.167500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414531.290827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414531.412544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414531.538681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414531.658622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414531.808559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414531.920243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414532.052156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414532.176579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414532.317220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414532.436800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414532.567325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414532.702373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414532.854444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414532.967234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414533.104782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414533.229838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414533.353992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414533.479581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414533.609663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414533.734216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414533.864704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414533.994698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414534.129506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414534.274426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414534.427169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414534.531807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414534.663571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414534.781795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414534.913749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414535.036337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414535.160688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414535.299571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414535.404919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414535.532179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414535.659152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414535.784233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414535.919866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414536.051873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414536.203277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414536.324077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414536.481878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414536.594004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414536.723385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414536.857290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414536.978142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414537.107234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414537.230412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414537.367734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414537.491950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414537.611187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414537.741221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414537.866873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414537.996394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414538.144461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414538.262603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414538.397124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414538.520497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414538.652825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414538.786570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414538.914463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414539.039314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414539.164351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414539.284640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414539.414474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414539.540049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414539.669434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414539.798046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414539.920363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414540.057640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414540.183572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414540.314631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414540.465930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414540.588266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414540.711951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414540.849612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414540.969119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414541.094691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414541.220705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414541.350238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414541.471734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414541.597607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414541.734123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414541.858130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414541.979864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414542.110555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414542.239722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414542.357581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414542.486150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414542.626465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414542.798702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414542.932575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414543.061338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414543.205500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414543.332311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414543.471765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414543.601092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414543.728818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414543.851875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414543.973744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414544.104984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414544.236570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414544.350913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414544.476622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414544.607445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414544.734335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414544.868571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414545.011506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414545.119776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414545.246663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414545.375021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414545.516436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414545.640749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414545.771043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414545.896623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414546.016551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414546.138138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414546.287394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414546.409423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414546.543399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414546.662217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414546.790640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414546.917033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414547.046508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414547.174113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414547.297774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414547.436851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414547.583536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414547.708828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414547.849157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414547.969206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414548.093970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414548.226773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414548.347925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414548.473933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414548.602984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414548.737240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414548.858667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414548.980299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414549.122169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414549.233145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414549.361247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414549.485756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414549.615971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414549.746679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414549.888461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414550.028336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414550.160666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414550.292428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414550.410341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414550.534453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414550.660308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414550.791198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414550.931139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414551.038930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414551.178881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414551.288335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414551.442687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414551.541732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414551.660383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414551.824890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414551.940452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414552.068244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414552.226011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414552.365672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414552.492419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414552.594729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414552.723688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414552.842933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414552.975793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414553.098635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414553.220453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414553.355696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414553.473317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414553.600571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414553.726508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414553.874751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414554.008998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414554.158342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414554.359430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414554.481228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414554.609121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414554.746381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414554.898020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414555.018186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414555.164520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414555.288831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414555.411234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414555.533364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414555.665168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414555.789505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414555.915656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414556.054548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414556.172463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414556.296649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414556.422773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414556.556275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414556.696176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414556.834716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414556.974408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414557.101854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414557.227230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414557.348977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414557.474904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414557.602336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414557.727907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414557.852247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414557.975483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414558.101317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414558.239930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414558.357782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414558.495800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414558.617233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414558.765680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414558.891020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414559.017646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414559.149503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414559.293917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414559.409822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414559.542902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414559.687950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414559.818960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414559.952665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414560.080634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414560.218064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414560.352957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414560.467625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414560.589983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414560.728141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414560.866266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414560.993104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414561.120289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414561.262878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414561.392192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414561.535364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414561.655571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414561.780609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414561.908967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414562.045166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414562.178383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414562.308528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414562.430389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414562.565270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414562.712309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414562.854314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414562.959908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414563.090991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414563.228399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414563.352251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414563.478028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414563.600442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414563.722805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414563.900409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414564.086992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414564.302651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414564.485707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414564.751234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414564.949523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414565.077741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414565.213934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414565.341196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414565.468655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414565.602695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414565.721058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414565.853881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414565.982139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414566.109239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414566.242823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414566.392357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414566.514229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414566.667850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414566.777936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414566.921633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414567.057644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414567.166657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414567.292960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414567.422553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414567.548970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414567.686651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414567.813293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414567.959850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414568.094632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414568.218684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414568.339595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414568.469707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414568.595285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414568.723461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414568.853023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414568.999486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414569.118911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414569.257785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414569.396901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414569.525759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414569.648510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414569.778864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414569.908508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414570.039836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414570.157016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414570.286659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414570.415154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414570.545063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414570.679583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414570.791504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414570.918523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414571.058936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414571.180449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414571.314159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414571.459068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414571.591038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414571.716012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414571.840630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414571.962583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414572.099766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414572.232058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414572.349340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414572.489191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414572.619851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414572.758222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414572.895843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414573.032974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414573.162893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414573.296373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414573.413476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414573.542310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414573.667426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414573.792164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414573.924388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414574.050756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414574.179896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414574.310851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414574.453872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414574.579618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414574.708051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414574.840811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414574.967971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414575.095721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414575.245489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414575.360209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414575.481559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414575.613290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414575.763679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414575.868030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414576.002177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414576.144850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414576.286586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414576.406468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414576.532955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414576.659145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414576.788400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414576.919608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414577.058798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414577.185224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414577.342534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414577.477448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414577.587731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414577.712226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414577.845931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414577.971970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414578.097996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414578.225981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414578.359823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414578.474252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414578.598890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414578.747313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414578.864668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414578.998543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414579.112119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414579.246852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414579.412749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414579.521932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414579.646256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414579.786869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414579.933332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414580.064810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414580.195893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414580.320189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414580.447701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414580.580915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414580.725877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414580.857740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414580.978223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414581.099654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414581.227567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414581.347022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414581.479795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414581.603637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414581.736195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414581.917182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414582.035372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414582.169226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414582.304485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414582.414986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414582.540094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414582.676223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414582.806317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414582.931169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414583.061472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414583.206760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414583.341866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414583.475224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414583.601885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414583.726954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414583.854676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414583.990324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414584.139318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414584.262347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414584.400365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414584.523373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414584.657270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414584.783633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414584.911738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414585.035384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414585.166282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414585.285774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414585.417626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414585.546241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414585.682489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414585.807355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414585.952862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414586.071564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414586.205315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414586.333567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414586.461643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414586.584894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414586.722047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414586.848121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414586.974638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414587.097504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414587.227585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414587.367380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414587.478342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414587.600109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414587.729484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414587.902237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414588.035970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414588.177738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414588.296099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414588.423123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414588.549213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414588.683632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414588.810215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414588.956855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414589.072817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414589.209009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414589.331216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414589.467698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414589.589767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414589.714532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414589.855275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414589.985462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414590.097003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414590.223642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414590.358989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414590.488120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414590.611712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414590.722579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414590.843551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414590.979474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414591.113541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414591.242766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414591.366866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414591.518921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414591.646597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414591.781268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414591.906347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414592.041444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414592.160909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414592.288785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414592.416406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414592.536885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414592.664691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414592.792459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414592.920788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414593.050073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414593.180902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414593.324279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414593.451970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414593.581890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414593.714921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414593.847516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414593.978630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414594.122731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414594.238272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414594.362650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414594.496614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414594.636655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414594.766480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414594.911684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414595.034528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414595.160806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414595.281792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414595.408775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414595.543255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414595.667389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414595.818664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414595.954398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414596.081349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414596.210154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414596.344546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414596.478856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414596.607404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414596.748283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414596.892119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414597.006744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414597.133335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414597.268731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414597.405127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414597.530118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414597.651752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414597.773807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414597.906553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414598.037509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414598.162428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414598.289438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414598.420345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414598.545169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414598.676588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414598.803413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414598.945584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414599.074318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414599.205572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414599.346346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414599.473187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414599.592585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414599.722968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414599.867809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414599.975997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414600.106227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414600.236221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414600.372087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414600.506686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414600.630342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414600.773919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414600.905048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414601.024286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414601.155782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414601.285654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414601.429370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414601.556256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414601.669760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414601.824406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414601.931927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414602.073950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414602.191215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414602.318112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414602.460111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414602.588502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414602.720396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414602.840593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414602.968142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414603.096730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414603.241592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414603.356131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414603.484019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414603.621581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414603.750774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414603.894809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414604.033604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414604.159404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414604.280493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414604.413752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414604.536811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414604.670151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414604.791733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414604.916652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414605.043138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414605.173010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414605.296061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414605.433672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414605.559788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414605.704906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414605.837605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414605.968651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414606.107953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414606.219697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414606.338942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414606.472392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414606.605766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414606.728060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414606.855122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414606.982296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414607.112732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414607.233951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414607.394237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414607.507722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414607.640605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414607.786133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414607.913592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414608.051528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414608.169737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414608.295702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414608.426452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414608.554088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414608.685830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414608.827200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414608.956114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414609.090892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414609.214637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414609.337728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414609.466986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414609.588866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414609.726151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414609.851112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414609.979594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414610.107007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414610.248279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414610.371289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414610.500947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414610.643421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414610.779619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414610.905124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414611.033159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414611.162181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414611.288815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414611.419152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414611.541441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414611.669534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414611.791409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414611.943904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414612.074556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414612.206255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414612.339905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414612.468335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414612.588344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414612.722098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414612.849998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414612.978568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414613.105525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414613.235614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414613.359727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414613.501674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414613.617250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414613.743931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414613.887443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414614.027640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414614.143862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414614.286542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414614.410419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414614.537740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414614.677161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414614.794409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414614.935457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414615.056172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414615.195550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414615.346638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414615.466450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414615.603655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414615.722435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414615.853453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414615.972165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414616.101853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414616.224033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414616.349120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414616.475481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414616.602289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414616.724058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414616.854208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414616.976404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414617.107131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414617.245871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414617.372019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414617.499603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414617.637301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414617.762653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414617.889546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414618.020004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414618.164737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414618.276281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414618.412785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414618.526260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414618.660028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414618.792413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414618.931994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414619.061327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414619.199772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414619.328571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414619.465854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414619.578006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414619.707983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414619.848003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414619.974283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414620.106129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414620.248244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414620.350548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414620.477664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414620.621412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414620.738726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414620.862488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414620.987658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414621.134774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414621.261686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414621.385681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414621.526505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414621.661693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414621.800174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414621.911487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414622.034415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414622.162652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414622.302002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414622.408852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414622.537327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414622.671740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414622.811977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414622.918291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414623.056982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414623.190081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414623.333448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414623.467219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414623.602306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414623.879005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414624.202799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414624.475856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414624.809838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414625.206074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414625.434075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414625.792258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414625.995952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414626.191074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414626.406843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414626.576249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414626.741989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414626.912888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414627.074068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414627.249726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414627.449567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414627.615933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414627.764436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414627.932368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414628.140214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414628.282068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414628.446978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414628.652966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414628.792906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414628.951594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414629.114307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414629.318715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414629.493828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414629.677716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414629.861234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414629.998118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414630.198192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414630.420979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414630.595017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414630.733513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414630.900362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414631.055615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414631.217293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414631.385692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414631.637941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414631.926108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414632.105028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414632.235497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414632.371500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414632.524366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414632.674150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414632.868602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414633.013005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414633.203906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414633.360201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414633.511525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414633.684805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414633.861959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414634.077309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414634.226388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414634.369850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414634.551422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414634.728708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414634.930634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414635.082056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414635.227285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414635.414473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414635.593740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414635.794811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414635.930312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414636.149153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414636.420410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414636.682427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414636.817504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414636.960139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414637.094791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414637.223994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414637.346879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414637.481435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414637.639434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414637.763484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414637.890270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414638.031842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414638.156688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414638.293895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414638.413091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414638.545797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414638.659367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414638.809415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414638.912319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414639.060134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414639.177629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414639.430562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414639.555715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414639.683646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414639.803987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414639.967693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414640.087652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414640.226099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414640.345343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414640.473691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414640.596124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414640.723940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414640.866388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414640.983649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414641.115293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414641.241363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414641.365181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414641.495886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414641.624664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414641.764253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414641.930566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414642.052596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414642.176481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414642.303068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414642.445279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414642.575101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414642.706380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414642.839552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414642.960901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414643.088118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414643.215593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414643.351036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414643.468190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414643.604206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414643.716565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414643.854405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414643.972024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414644.102077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414644.234936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414644.347997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414644.489192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414644.639435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414644.756906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414644.899029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414645.025324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414645.155587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414645.278807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414645.412632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414645.533410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414645.660091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414645.799403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414645.914938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414646.031868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414646.165851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414646.288765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414646.422099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414646.550098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414646.683077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414646.815065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414646.957461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414647.075664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414647.215927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414647.343158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414647.475728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414647.588967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414647.724860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414647.852947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414647.994567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414648.132959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414648.240336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414648.376969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414648.511079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414648.642151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414648.790976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414648.903402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414649.030525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414649.156209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414649.291106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414649.419143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414649.555871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414649.678151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414649.828444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414649.973515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414650.103751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414650.230220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414650.350706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414650.475560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414650.603307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414650.729482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414650.867593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414650.986745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414651.127503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414651.253640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414651.389108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414651.524086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414651.679997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414651.784417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414651.918679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414652.037427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414652.168117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414652.304175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414652.416062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414652.540527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414652.677256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414652.791260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414652.925446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414653.054583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414653.199777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414653.332243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414653.469213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414653.587405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414653.722260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414653.846923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414653.979014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414654.103084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414654.241048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414654.356293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414654.488269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414654.614016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414654.755335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414654.884830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414655.008273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414655.149775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414655.283159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414655.412604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414655.546631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414655.663287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414655.789037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414655.930807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414656.071933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414656.196465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414656.328287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414656.457987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414656.595834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414656.716006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414656.846436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414656.982143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414657.099708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414657.228471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414657.352258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414657.476914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414657.615519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414657.745038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414657.868157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414657.995831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414658.133286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414658.268087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414658.394038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414658.529938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414658.657774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414658.789991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414658.926659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414659.031462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414659.175391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414659.300673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414659.427325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414659.565986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414659.706166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414659.838369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414659.962001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414660.091428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414660.237288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414660.339486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414660.477184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414660.598963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414660.726422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414660.851125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414660.975184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414661.103772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414661.247929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414661.357700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414661.497424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414661.613615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414661.743591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414661.891098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414662.020751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414662.145057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414662.283949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414662.404824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414662.532949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414662.669278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414662.785359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414662.901615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414663.034422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414663.159781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414663.292275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414663.408347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414663.539631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414663.664610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414663.793231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414663.920147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414664.050990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414664.175851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414664.317321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414664.444653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414664.589247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414664.718585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414664.853500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414664.969015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414665.091932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414665.217079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414665.351362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414665.472318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414665.601943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414665.727031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414665.880012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414666.041260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414666.164565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414666.287560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414666.415464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414666.559726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414666.696593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414666.804823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414666.945673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414667.080262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414667.235232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414667.338404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414667.469109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414667.586885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414667.726524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414667.853179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414667.996006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414668.141605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414668.264315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414668.386859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414668.518788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414668.648059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414668.785346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414668.916905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414669.045447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414669.166218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414669.317935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414669.429770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414669.562900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414669.694962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414669.845756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414669.976876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414670.093154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414670.226319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414670.368701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414670.499601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414670.618496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414670.759467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414670.890261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414671.027210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414671.157517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414671.277769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414671.410232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414671.526316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414671.651293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414671.780232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414671.925921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414672.049290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414672.186609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414672.330964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414672.471870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414672.593745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414672.726967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414672.846828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414672.987829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414673.104650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414673.245348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414673.367095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414673.516745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414673.626777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414673.767017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414673.907839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414674.050498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414674.154653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414674.290399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414674.410389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414674.533266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414674.673207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414674.788181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414674.903499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414675.034409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414675.154100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414675.286256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414675.410125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414675.535993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414675.656171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414675.802068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414675.911568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414676.042503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414676.166466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414676.291962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414676.412125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414676.553284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414676.678417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414676.819876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414676.937160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414677.092770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414677.215883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414677.348149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414677.472452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414677.598755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414677.738191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414677.862653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414677.978312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414678.113611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414678.243051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414678.400109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414678.529040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414678.656361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414678.782618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414678.915857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414679.040868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414679.186681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414679.308651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414679.420735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414679.550497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414679.678818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414679.813343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414679.950031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414680.089139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414680.212933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414680.339478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414680.476511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414680.600488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414680.732770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414680.856928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414680.985523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414681.115796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414681.240497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414681.377026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414681.518041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414681.627330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414681.770654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414681.903637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414682.050312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414682.160319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414682.283970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414682.409321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414682.539937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414682.665818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414682.802954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414682.928620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414683.076311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414683.205888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414683.338975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414683.461706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414683.596942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414683.728161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414683.851537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414683.971869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414684.102947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414684.225637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414684.351872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414684.485874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414684.602190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414684.728548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414684.866335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414685.006058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414685.148495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414685.325425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414685.507695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414685.628867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414685.756777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414685.906240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414686.033561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414686.156002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414686.284384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414686.408923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414686.544026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414686.663073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414686.801460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414686.941828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414687.074491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414687.211418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414687.347172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414687.463906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414687.598583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414687.721433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414687.849719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414687.967096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414688.099339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414688.228232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414688.365084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414688.512103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414688.644779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414688.766946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414688.901912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414689.028305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414689.156477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414689.282854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414689.407700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414689.531755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414689.658109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414689.778255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414689.911022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414690.033216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414690.163063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414690.287439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414690.413152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414690.539439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414690.668684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414690.794855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414690.929703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414691.067477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414691.204947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414691.332315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414691.467208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414691.588305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414691.740784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414691.865907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414691.990371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414692.124324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414692.292590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414692.406006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414692.539746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414692.647532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414692.780954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414692.909322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414693.036320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414693.153462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414693.282114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414693.417198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414693.549515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414693.671040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414693.804342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414693.928613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414694.073754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414694.206773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414694.339542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414694.464533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414694.594668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414694.721711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414694.848134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414694.969116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414695.103448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414695.225048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414695.352695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414695.482254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414695.641744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414695.755545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414695.917339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414696.016103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414696.152992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414696.274972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414696.401638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414696.526368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414696.672973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414696.780670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414696.911747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414697.035855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414697.166444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414697.301015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414697.417841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414697.549859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414697.688809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414697.814720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414697.971920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414698.096101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414698.220821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414698.361441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414698.471234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414698.597042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414698.719484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414698.846958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414698.978278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414699.115618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414699.232688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414699.360130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414699.486698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414699.604940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414699.763832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414699.919136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414700.056968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414700.180047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414700.322241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414700.444314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414700.583749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414700.705160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414700.833373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414700.975945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414701.094424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414701.216734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414701.345009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414701.476688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414701.598379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414701.718564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414701.859635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414702.011158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414702.155821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414702.274909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414702.417061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414702.533831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414702.663376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414702.789948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414702.920254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414703.043877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414703.181861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414703.303412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414703.454879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414703.574672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414703.721788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414703.844157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414703.974665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414704.099568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414704.237682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414704.355769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414704.487631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414704.617037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414704.751843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414704.904439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414705.014644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414705.153029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414705.276305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414705.401727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414705.530504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414705.662065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414705.780878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414705.922997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414706.052403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414706.175592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414706.301262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414706.431167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414706.578130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414706.699247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414706.840081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414706.957223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414707.096435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414707.203528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414707.342968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414707.469168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414707.596741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414707.721855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414707.857930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414707.979998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414708.116401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414708.257861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414708.401778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414708.529229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414708.656344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414708.786663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414708.908019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414709.040641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414709.183264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414709.300591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414709.430052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414709.573638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414709.714674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414709.836012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414709.970284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414710.090933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414710.216003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414710.337991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414710.475042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414710.598861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414710.733973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414710.864261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414710.998652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414711.133072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414711.269644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414711.401557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414711.530004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414711.654289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414711.794931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414711.904999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414712.034482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414712.156549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414712.289487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414712.422455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414712.571173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414712.700496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414712.825596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414712.968058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414713.103769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414713.209355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414713.362679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414713.467977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414713.593411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414713.737160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414713.849955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414713.979132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414714.123007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414714.235030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414714.371797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414714.507898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414714.641821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414714.766812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414714.891101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414715.017940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414715.151888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414715.268624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414715.399514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414715.526342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414715.656756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414715.781186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414715.936280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414716.074702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414716.206886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414716.328563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414716.464515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414716.597955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414716.720449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414716.838913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414716.976978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414717.099592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414717.227360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414717.365529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414717.491029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414717.613097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414717.746438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414717.890538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414718.016941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414718.143360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414718.270595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414718.409235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414718.548282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414718.665879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414718.795133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414718.945373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414719.059204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414719.189573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414719.338846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414719.463517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414719.590618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414719.717235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414719.854561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414719.989158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414720.113877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414720.244232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414720.385283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414720.509760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414720.647632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414720.771877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414720.896539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414721.028400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414721.152032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414721.277880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414721.402435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414721.526954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414721.651562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414721.777515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414721.907038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414722.037780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414722.160961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414722.282118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414722.422042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414722.533236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414722.662876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414722.822347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414722.943748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414723.070925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414723.201752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414723.342915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414723.461119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414723.586658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414723.711037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414723.837095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414723.988174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414724.094760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414724.221799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414724.348248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414724.474084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414724.601282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414724.731983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414724.852129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414724.994671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414725.114562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414725.254962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414725.386185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414725.522461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414725.655466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414725.786732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414725.912302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414726.049689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414726.178523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414726.320443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414726.447072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414726.577097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414726.706061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414726.842385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414726.970670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414727.103912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414727.225280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414727.359145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414727.491323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414727.629582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414727.770437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414727.904981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414728.028258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414728.156256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414728.296687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414728.405504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414728.544416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414728.665295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414728.796863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414728.914528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414729.039485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414729.175868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414729.306361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414729.449234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414729.575147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414729.693956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414729.837953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414729.979720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414730.095432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414730.223079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414730.339913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414730.465621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414730.597197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414730.716048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414730.846655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414730.990591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414731.111366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414731.239899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414731.364757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414731.492490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414731.622598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414731.767962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414731.911360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414732.037233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414732.164562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414732.300197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414732.421098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414732.550297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414732.690373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414732.826444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414732.956706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414733.092431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414733.218953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414733.343523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414733.469621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414733.598378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414733.726231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414733.855459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414733.987077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414734.120236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414734.244161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414734.381985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414734.514735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414734.649236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414734.780412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414734.903486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414735.032595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414735.160390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414735.302026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414735.427481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414735.555830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414735.667325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414735.791854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414735.933240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414736.070268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414736.215205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414736.338472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414736.466151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414736.581824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414736.722674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414736.838943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414736.969481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414737.094773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414737.243640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414737.349684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414737.483383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414737.621659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414737.740479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414737.872925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414737.997009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414738.136171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414738.266158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414738.408450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414738.535055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414738.657630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414738.789662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414738.908064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414739.031932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414739.167573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414739.296556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414739.420055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414739.550240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414739.685673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414739.801719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414739.949525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414740.074998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414740.213903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414740.337052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414740.471108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414740.595924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414740.719277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414740.846055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414740.971860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414741.108945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414741.226094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414741.371569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414741.495678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414741.628761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414741.748329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414741.886348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414742.024862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414742.165709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414742.272666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414742.410307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414742.529203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414742.657577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414742.791708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414742.918026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414743.041114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414743.155141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414743.290917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414743.416264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414743.537946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414743.668023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414743.796368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414743.932915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414744.075063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414744.211540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414744.328783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414744.462067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414744.591995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414744.725980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414744.844244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414744.973485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414745.096522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414745.221305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414745.347066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414745.471374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414745.597479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414745.736182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414745.849815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414745.974873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414746.096041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414746.225258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414746.349612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414746.473275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414746.600761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414746.730158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414746.849769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414746.977049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414747.101426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414747.232355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414747.352573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414747.512809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414747.674170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414747.814594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414747.925909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414748.071400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414748.191791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414748.327069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414748.447880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414748.577159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414748.717222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414748.847341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414748.968314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414749.113796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414749.236035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414749.356628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414749.486574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414749.612015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414749.736802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414749.879375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414750.005767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414750.134745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414750.253962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414750.391352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414750.535774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414750.651729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414750.781832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414750.909934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414751.031346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414751.161623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414751.282596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414751.416353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414751.536859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414751.672891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414751.816263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414751.958196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414752.078847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414752.214919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414752.344855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414752.472414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414752.597905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414752.726413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414752.848989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414752.976698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414753.103838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414753.238984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414753.369111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414753.509630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414753.653111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414753.774890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414753.911048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414754.053512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414754.159040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414754.290093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414754.412276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414754.594371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414754.866226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414755.173863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414755.636967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414756.054762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414756.345434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414756.570514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414756.783316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414757.019461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414757.177739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414757.357526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414757.530784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414757.711040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414757.866091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414758.032427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414758.219701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414758.380378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414758.547806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414758.721047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414758.913107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414759.046381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414759.216211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414759.361250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414759.547018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414759.720789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414759.903871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414760.083268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414760.246570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414760.417770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414760.594690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414760.859826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414761.047383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414761.291413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414761.452399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414761.608305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414761.771986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414761.969563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414762.144638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414762.300050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414762.503263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414762.757166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414763.000025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414763.153129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414763.283116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414763.411647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414763.542602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414763.706007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414763.883709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414764.066885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414764.237017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414764.445608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414764.588014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414764.726686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414764.912538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414765.079507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414765.280944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414765.463923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414765.591774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414765.776778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414765.932708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414766.135541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414766.323522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414766.506937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414766.658696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414766.837490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414767.003342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414767.380516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414767.514827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414767.766330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414767.915150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414768.063347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414768.190293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414768.333452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414768.461354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414768.588831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414768.709659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414768.846322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414768.974809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414769.100450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414769.238343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414769.355062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414769.495679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414769.609241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414769.730796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414769.881974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414770.014411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414770.170568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414770.411461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414770.531342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414770.662172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414770.781064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414770.909003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414771.028546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414771.159059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414771.286089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414771.447483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414771.551200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414771.676189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414771.806073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414771.946156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414772.081233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414772.213477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414772.338559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414772.467982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414772.590063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414772.720449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414772.834918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414772.968166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414773.092147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414773.237729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414773.359122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414773.475478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414773.609823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414773.732879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414773.872875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414774.005342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414774.138342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414774.286180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414774.400851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414774.530391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414774.656273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414774.778243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414774.926304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414775.031425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414775.160246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414775.289647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414775.410167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414775.565353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414775.695655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414775.836823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414775.985209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414776.111534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414776.230248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414776.362456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414776.486779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414776.621058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414776.761362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414776.901989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414777.022068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414777.151889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414777.288857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414777.412381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414777.538646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414777.661713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414777.786686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414777.922343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414778.053027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414778.182042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414778.330939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414778.468045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414778.586664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414778.718064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414778.848878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414778.974846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414779.102415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414779.241573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414779.387653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414779.506553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414779.638438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414779.777462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414779.894307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414780.037669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414780.160952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414780.296466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414780.424069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414780.568112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414780.694702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414780.808205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414780.964411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414781.092579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414781.209334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414781.340273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414781.470632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414781.595824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414781.728137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414781.860801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414781.991306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414782.134214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414782.259533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414782.398767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414782.526715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414782.665012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414782.796726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414782.906983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414783.038566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414783.172014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414783.293131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414783.432198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414783.570480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414783.709453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414783.833709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414783.986513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414784.091738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414784.212660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414784.347356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414784.479778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414784.604096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414784.726772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414784.858379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414785.006815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414785.163573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414785.346571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414785.465433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414785.594365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414785.726936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414785.854577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414785.985296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414786.117091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414786.304437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414786.534559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414786.796729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414786.991923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414787.216167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414787.338550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414787.468532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414787.595292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414787.716852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414787.847540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414787.971653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414788.102552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414788.227376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414788.352243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414788.486812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414788.607241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414788.825849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414788.926684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414789.078055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414789.200201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414789.326234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414789.445692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414789.580822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414789.699801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414789.843133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414789.963089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414790.092265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414790.213627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414790.346184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414790.471065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414790.600047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414790.713659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414790.859155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414790.971944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414791.118063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414791.227988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414791.357456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414791.485363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414791.633778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414791.760955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414791.899255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414792.049505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414792.158443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414792.301098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414792.414811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414792.535135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414792.665209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414792.806077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414792.945338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414793.071907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414793.207305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414793.332587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414793.471080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414793.601818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414793.718423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414793.848983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414793.972871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414794.106462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414794.225658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414794.364835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414794.480188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414794.611430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414794.736779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414794.862816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414795.019972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414795.146771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414795.278914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414795.398341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414795.528459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414795.646960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414795.783506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414795.901060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414796.036024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414796.158672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414796.290954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414796.410766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414796.536171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414796.665106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414796.802249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414796.946497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414797.070743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414797.201360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414797.334952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414797.457120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414797.588352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414797.715010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414797.848005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414797.968371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414798.098023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414798.223209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414798.353259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414798.486401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414798.612252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414798.738446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414798.883022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414799.011420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414799.144164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414799.270857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414799.390205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414799.535379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414799.650375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414799.777933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414799.913890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414800.027960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414800.160401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414800.280254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414800.420303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414800.552891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414800.702359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414800.815378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414800.953557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414801.100561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414801.222221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414801.334457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414801.464560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414801.598967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414801.715206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414801.844624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414801.987981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414802.100108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414802.240131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414802.363406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414802.487000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414802.617690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414802.763247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414802.884286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414803.012912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414803.139992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414803.273369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414803.401132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414803.536731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414803.660323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414803.791943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414803.924544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414804.050203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414804.188697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414804.317522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414804.441466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414804.578825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414804.698476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414804.840351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414804.958730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414805.089982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414805.213155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414805.347127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414805.468537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414805.601078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414805.732433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414805.860245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414805.992553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414806.133512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414806.271648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414806.396394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414806.541934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414806.653177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414806.778438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414806.904737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414807.050217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414807.159158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414807.295998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414807.413197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414807.537097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414807.665436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414807.789459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414807.913877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414808.040430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414808.188670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414808.304850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414808.440591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414808.579531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414808.712481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414808.830849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414808.962604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414809.086784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414809.214662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414809.349706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414809.468805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414809.595435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414809.724894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414809.850439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414809.996212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414810.119884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414810.252522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414810.382493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414810.515094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414810.663652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414810.777211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414810.902797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414811.030973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414811.154342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414811.282452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414811.403999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414811.537968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414811.679045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414811.786828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414811.908484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414812.041442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414812.169316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414812.297858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414812.424912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414812.564665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414812.708009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414812.837071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414812.962754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414813.110118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414813.226298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414813.344543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414813.472504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414813.622681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414813.738962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414813.875390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414814.010529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414814.135262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414814.275350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414814.408979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414814.529575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414814.657452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414814.780393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414814.909520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414815.029714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414815.159860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414815.286319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414815.414813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414815.541416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414815.672067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414815.796870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414815.927398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414816.099950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414816.320226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414816.458018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414816.597699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414816.723284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414816.859155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414816.996905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414817.124055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414817.259501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414817.400176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414817.519409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414817.653242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414817.779143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414817.906792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414818.030038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414818.154598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414818.282721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414818.412790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414818.534283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414818.671283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414818.816945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414818.946797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414819.071949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414819.210236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414819.332762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414819.467555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414819.589760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414819.718451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414819.857006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414819.989924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414820.121349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414820.257635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414820.383805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414820.527771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414820.648937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414820.783204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414820.910492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414821.037333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414821.165910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414821.297263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414821.436914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414821.583228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414821.705590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414821.852361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414822.009032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414822.130940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414822.265447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414822.402344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414822.523714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414822.651896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414822.776124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414822.897938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414823.026948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414823.156767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414823.276945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414823.430732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414823.540628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414823.674503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414823.797458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414823.955239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414824.085164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414824.222375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414824.334474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414824.469704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414824.592824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414824.715300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414824.832494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414824.969065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414825.090956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414825.217947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414825.341712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414825.474608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414825.600352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414825.731301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414825.851513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414826.006220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414826.136243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414826.256540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414826.402011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414826.519989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414826.650323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414826.786135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414826.915847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414827.050251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414827.186410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414827.323416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414827.453371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414827.586926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414827.709569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414827.856099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414827.977309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414828.112742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414828.255749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414828.366577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414828.508162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414828.655707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414828.771535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414828.909436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414829.030106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414829.171011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414829.283603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414829.423670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414829.548893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414829.697313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414829.817545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414829.962453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414830.090660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414830.206349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414830.332191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414830.467611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414830.600599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414830.723891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414830.843350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414830.971662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414831.099804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414831.231475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414831.357430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414831.489927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414831.620915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414831.758541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414831.890827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414832.031528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414832.143473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414832.280088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414832.404713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414832.549955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414832.670811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414832.825593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414832.950542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414833.075062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414833.213497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414833.341717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414833.468029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414833.596908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414833.725508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414833.861888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414833.985047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414834.137224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414834.276393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414834.398664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414834.522665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414834.653952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414834.777809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414834.906191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414835.033892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414835.173546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414835.299430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414835.424323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414835.558258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414835.693603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414835.835408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414835.986634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414836.097445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414836.233553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414836.354236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414836.484732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414836.620121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414836.755660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414836.890664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414837.044188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414837.154620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414837.276774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414837.404701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414837.538423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414837.661222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414837.803173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414837.916487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414838.051719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414838.190867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414838.321645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414838.456959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414838.587452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414838.718448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414838.843209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414838.964352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414839.094293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414839.219236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414839.361898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414839.474604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414839.625364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414839.736863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414839.874629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414839.998179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414840.149156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414840.278681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414840.405347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414840.530875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414840.652409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414840.775902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414840.904493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414841.028078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414841.155459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414841.286514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414841.422717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414841.543925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414841.690985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414841.819007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414841.954423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414842.079100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414842.216811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414842.345676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414842.470102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414842.589028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414842.720197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414842.844044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414842.992338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414843.102892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414843.232895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414843.389950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414843.513144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414843.642685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414843.766943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414843.888104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414844.021558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414844.157227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414844.284482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414844.412695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414844.545754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414844.679170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414844.798112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414844.941048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414845.081766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414845.212746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414845.347803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414845.475592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414845.607022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414845.736146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414845.891156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414846.008669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414846.146112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414846.276553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414846.415414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414846.529364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414846.668839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414846.782550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414846.910552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414847.034050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414847.163177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414847.279635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414847.424922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414847.549542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414847.670575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414847.803180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414847.930819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414848.064981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414848.193523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414848.323526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414848.464609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414848.584579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414848.720018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414848.842460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414848.973518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414849.091409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414849.227174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414849.356059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414849.484364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414849.610876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414849.743825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414849.907966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414850.037221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414850.140743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414850.269715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414850.387992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414850.522898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414850.641287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414850.771951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414850.917079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414851.030801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414851.152274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414851.288199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414851.398605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414851.524778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414851.651563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414851.797591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414851.930098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414852.078371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414852.199975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414852.328850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414852.468051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414852.590529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414852.715124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414852.841440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414852.960569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414853.094354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414853.216690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414853.349280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414853.481199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414853.628216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414853.736104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414853.882265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414854.010129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414854.143759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414854.281007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414854.401593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414854.528772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414854.653193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414854.777785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414854.905076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414855.028702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414855.166987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414855.293914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414855.409425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414855.534332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414855.719565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414855.853468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414856.013179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414856.116575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414856.252547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414856.382188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414856.524069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414856.643657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414856.778400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414856.902677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414857.035406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414857.170192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414857.280429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414857.412073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414857.545308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414857.662812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414857.799867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414857.925792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414858.084244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414858.196487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414858.356497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414858.474033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414858.614763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414858.752075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414858.899791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414859.011936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414859.180867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414859.278590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414859.410339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414859.532393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414859.650823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414859.783110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414859.907138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414860.032534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414860.157418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414860.278114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414860.408679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414860.546025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414860.671104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414860.779943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414860.913316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414861.030171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414861.153924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414861.296140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414861.423927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414861.550358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414861.676643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414861.803724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414861.947185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414862.075339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414862.218437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414862.338227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414862.467017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414862.586627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414862.711570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414862.840863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414862.971490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414863.091142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414863.217578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414863.354420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414863.480862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414863.604496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414863.751181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414863.874851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414864.007110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414864.137077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414864.288130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414864.395709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414864.525337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414864.664370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414864.771566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414864.895819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414865.026101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414865.149214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414865.282556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414865.402491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414865.535219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414865.656358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414865.798207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414865.921852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414866.047389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414866.185037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414866.312056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414866.458299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414866.588016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414866.718014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414866.857597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414866.963534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414867.093115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414867.218250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414867.346838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414867.469744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414867.598429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414867.723704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414867.859831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414867.982073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414868.125056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414868.256588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414868.398317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414868.524421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414868.654356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414868.770244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414868.900435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414869.026008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414869.159277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414869.281583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414869.410810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414869.530909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414869.668496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414869.797796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414869.950823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414870.055413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414870.175403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414870.329346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414870.464105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414870.589371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414870.711149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414870.840639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414870.961900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414871.107159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414871.223303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414871.362849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414871.475231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414871.596560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414871.735400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414871.865476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414872.009873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414872.134200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414872.272032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414872.399692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414872.523201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414872.645116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414872.780328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414872.909601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414873.036492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414873.148644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414873.297148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414873.408976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414873.542283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414873.670717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414873.809021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414873.931266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414874.087922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414874.207286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414874.336904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414874.466264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414874.589831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414874.724264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414874.857941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414874.976936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414875.091888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414875.224406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414875.372472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414875.485801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414875.634598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414875.760003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414875.885434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414876.019416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414876.151920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414876.273291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414876.419737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414876.525214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414876.659338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414876.777443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414876.902337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414877.027312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414877.158988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414877.275845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414877.420418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414877.530102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414877.656866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414877.784606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414877.918223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414878.039248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414878.170223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414878.297362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414878.425736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414878.574624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414878.711130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414878.832035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414878.968137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414879.097696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414879.211988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414879.339633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414879.466364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414879.594610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414879.731681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414879.861825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414880.012224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414880.131743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414880.264012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414880.393187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414880.525887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414880.654108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414880.788691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414880.904317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414881.036891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414881.174325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414881.296312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414881.441363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414881.566783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414881.703004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414881.848635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414881.982164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414882.119040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414882.251084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414882.392604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414882.521045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414882.643259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414882.769360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414882.901626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414883.014844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414883.139110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414883.276296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414883.419315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414883.534418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414883.665355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414883.796596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414883.956514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414884.074740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414884.207835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414884.330464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414884.456007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414884.610101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414884.824335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414885.102798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414885.419313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414885.732807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414886.146058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414886.491956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414886.769285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414887.058780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414887.232852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414887.501342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414887.717947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414887.896239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414888.051400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414888.232384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414888.405296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414888.572409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414888.755656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414888.928130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414889.097416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414889.277699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414889.447464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414889.660253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414889.833288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414890.008299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414890.186952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414890.368358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414890.522590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414890.712769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414890.906393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414891.046110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414891.283258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414891.462794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414891.616710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414891.766929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414891.920996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414892.120006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414892.271612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414892.428138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414892.632977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414892.920933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414893.094364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414893.232327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414893.363292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414893.508426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414893.652808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414893.845009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414894.027601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414894.166676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414894.337912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414894.495515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414894.662472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414894.849240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414895.032585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414895.254071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414895.383727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414895.550651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414895.714732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414895.908167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414896.078067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414896.261045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414896.430326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414896.570339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414896.745316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414896.927032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414897.132329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414897.404562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414897.554368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414897.799432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414897.986372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414898.124165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414898.264033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414898.394354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414898.522726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414898.650817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414898.780170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414898.935910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414899.049869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414899.190666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414899.314270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414899.451909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414899.577360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414899.716517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414899.836804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414899.965332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414900.111732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414900.261757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414900.473091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414900.623665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414900.757488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414900.878257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414901.009838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414901.144924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414901.270439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414901.393651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414901.517841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414901.649200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414901.782169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414901.916158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414902.050083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414902.173238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414902.288929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414902.410514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414902.536742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414902.663960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414902.789130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414902.920162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414903.050918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414903.178187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414903.307678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414903.445259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414903.569200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414903.704865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414903.836783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414903.953161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414904.092874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414904.212467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414904.342364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414904.470796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414904.604298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414904.726600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414904.861464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414904.984900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414905.111718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414905.264881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414905.379321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414905.528476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414905.669980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414905.789140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414905.919067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414906.035577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414906.168491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414906.320999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414906.454928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414906.577480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414906.713692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414906.837858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414906.971940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414907.108373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414907.240891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414907.377581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414907.515336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414907.638009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414907.769020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414907.901278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414908.034375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414908.166153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414908.297452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414908.431195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414908.583071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414908.701546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414908.842388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414908.968232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414909.096395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414909.220422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414909.348004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414909.486632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414909.605448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414909.736471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414909.878258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414909.992977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414910.137702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414910.274407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414910.403524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414910.529356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414910.658820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414910.785062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414910.922998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414911.046003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414911.194953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414911.319507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414911.460411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414911.583207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414911.724436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414911.841764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414912.002438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414912.106404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414912.234658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414912.372653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414912.526734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414912.647115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414912.778432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414912.905657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414913.028356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414913.150014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414913.280171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414913.405146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414913.530328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414913.662022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414913.785694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414913.917264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414914.046662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414914.181203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414914.316373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414914.428919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414914.569237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414914.700364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414914.849583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414914.958646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414915.094310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414915.207025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414915.335344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414915.454515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414915.591000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414915.701907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414915.842356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414915.960397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414916.093913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414916.239357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414916.347507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414916.475129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414916.606412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414916.728401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414916.869741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414916.995551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414917.128350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414917.259527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414917.399589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414917.520946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414917.649301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414917.775794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414917.895409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414918.018694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414918.156335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414918.284517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414918.402960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414918.522135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414918.656975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414918.782174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414918.910854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414919.043189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414919.191222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414919.315051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414919.436885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414919.570802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414919.709623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414919.833802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414919.971845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414920.098528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414920.224630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414920.356829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414920.503404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414920.619683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414920.761134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414920.881786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414921.016625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414921.142911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414921.267794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414921.397275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414921.520972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414921.641741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414921.764382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414921.901253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414922.021656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414922.168161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414922.279656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414922.404853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414922.542386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414922.671802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414922.813987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414922.941484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414923.079854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414923.203538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414923.337185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414923.459823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414923.592685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414923.718132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414923.853459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414923.972880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414924.104925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414924.238161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414924.387671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414924.515583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414924.633814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414924.778801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414924.906201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414925.027372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414925.160032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414925.285950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414925.417576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414925.542166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414925.667760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414925.801797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414925.949371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414926.077329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414926.204527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414926.330729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414926.459265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414926.603355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414926.724024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414926.838483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414926.969246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414927.090042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414927.221456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414927.340214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414927.469752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414927.593956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414927.729341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414927.854646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414928.002609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414928.120817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414928.267954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414928.391116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414928.524451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414928.652875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414928.777835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414928.900685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414929.031293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414929.159616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414929.283926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414929.409997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414929.545973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414929.674689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414929.810814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414929.931685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414930.074670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414930.208568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414930.342065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414930.469814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414930.603116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414930.738530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414930.849712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414930.980097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414931.127822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414931.250261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414931.397759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414931.523296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414931.650340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414931.773430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414931.900533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414932.025296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414932.153725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414932.287253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414932.404133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414932.529839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414932.670913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414932.796257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414932.944316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414933.063747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414933.196259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414933.334370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414933.463166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414933.586259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414933.716684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414933.843873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414933.958539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414934.085269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414934.219015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414934.336665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414934.465548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414934.587004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414934.714715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414934.842118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414934.978241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414935.084704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414935.235481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414935.344435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414935.474104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414935.599619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414935.729258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414935.856860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414935.981176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414936.107453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414936.237104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414936.367477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414936.506004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414936.634719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414936.758487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414936.895492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414937.037071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414937.168246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414937.285470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414937.414763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414937.535242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414937.670627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414937.822253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414937.946451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414938.067089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414938.194793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414938.331629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414938.450865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414938.597106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414938.711456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414938.832167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414938.959121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414939.092181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414939.237046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414939.379316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414939.506822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414939.642276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414939.763621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414939.896922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414940.036823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414940.152140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414940.276152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414940.418710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414940.542051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414940.661610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414940.787763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414940.926413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414941.057176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414941.188756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414941.322385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414941.463949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414941.586431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414941.710789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414941.838937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414941.994442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414942.123266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414942.235047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414942.381065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414942.508479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414942.642464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414942.769193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414942.888158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414943.017865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414943.143502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414943.273731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414943.402819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414943.525564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414943.651356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414943.778558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414943.912184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414944.045241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414944.170294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414944.330841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414944.445365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414944.577694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414944.702476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414944.822268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414944.954053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414945.083679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414945.206952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414945.327514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414945.464150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414945.598965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414945.782064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414945.921271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414946.043676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414946.192511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414946.320863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414946.485973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414946.655801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414946.792990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414946.921958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414947.067919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414947.186333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414947.330331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414947.459654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414947.597294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414947.705731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414947.847451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414947.977650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414948.103482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414948.247384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414948.374628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414948.506109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414948.629676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414948.770370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414948.904470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414949.023688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414949.159888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414949.282484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414949.427242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414949.543728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414949.671266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414949.807850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414949.941238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414950.077215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414950.209785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414950.330659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414950.466162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414950.597202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414950.718126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414950.829994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414950.971182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414951.088429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414951.222917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414951.349460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414951.494384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414951.634017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414951.777861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414951.944899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414952.159327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414952.340679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414952.501485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414952.656226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414952.820895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414952.979900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414953.118381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414953.293681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414953.438750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414953.585111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414953.732086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414953.910035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414954.085401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414954.236744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414954.355376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414954.537693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414954.660298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414954.835086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414954.964982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414955.148895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414955.267920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414955.421880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414955.539658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414955.690542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414955.852388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414956.045786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414956.273529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414956.477024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414956.594780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414956.737257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414956.903886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414957.057759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414957.250522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414957.408594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414957.520884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414957.648371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414957.770940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414957.896776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414958.029190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414958.153004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414958.278375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414958.416497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414958.535097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414958.659471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414958.790150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414958.925667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414959.066293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414959.209800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414959.325633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414959.453949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414959.599751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414959.702308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414959.826004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414959.959324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414960.087961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414960.213583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414960.343837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414960.467275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414960.595723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414960.728423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414960.862183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414960.994981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414961.145056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414961.286857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414961.402265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414961.527982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414961.670060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414961.780919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414961.911178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414962.042727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414962.174618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414962.309104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414962.431228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414962.586470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414962.707158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414962.828897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414962.959839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414963.083090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414963.234469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414963.409654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414963.529706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414963.658565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414963.780707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414963.919581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414964.035462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414964.151395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414964.285491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414964.406152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414964.545673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414964.682434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414964.795892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414964.917890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414965.044738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414965.182170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414965.325862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414965.455485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414965.588198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414965.711484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414965.840826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414965.968028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414966.096985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414966.217646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414966.360696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414966.461569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414966.588663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414966.721606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414966.846884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414966.980971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414967.097861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414967.224097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414967.356009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414967.487395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414967.628901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414967.765843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414967.896589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414968.013363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414968.148501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414968.276654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414968.405061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414968.525048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414968.652428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414968.777249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414968.908920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414969.034752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414969.159534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414969.303273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414969.427527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414969.557330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414969.708362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414969.827405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414969.960605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414970.088003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414970.230005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414970.341313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414970.467365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414970.611112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414970.726680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414970.856052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414970.990470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414971.125439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414971.246821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414971.392147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414971.543384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414971.646148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414971.772344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414971.928288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414972.057936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414972.188657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414972.331040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414972.470735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414972.579206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414972.704748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414972.834343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414972.966245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414973.106002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414973.215931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414973.355452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414973.466976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414973.601956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414973.727782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414973.894065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414974.019107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414974.140649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414974.285613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414974.399010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414974.529470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414974.652837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414974.776004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414974.909461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414975.030266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414975.164386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414975.290679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414975.414525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414975.546171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414975.677957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414975.821495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414975.957008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414976.094275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414976.233074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414976.340432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414976.467724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414976.593814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414976.730434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414976.870692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414976.997608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414977.121912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414977.258504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414977.378297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414977.513239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414977.639684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414977.773021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414977.899895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414978.024632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414978.150412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414978.276043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414978.403710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414978.536711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414978.659348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414978.792416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414978.917864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414979.062941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414979.193762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414979.329874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414979.450074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414979.574855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414979.699574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414979.848416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414979.968885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414980.096817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414980.229859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414980.356853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414980.504086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414980.626207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414980.763790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414980.896263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414981.026561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414981.151053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414981.275468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414981.398061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414981.527306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414981.669055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414981.773898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414981.909806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414982.027248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414982.166711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414982.312727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414982.459598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414982.577324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414982.715401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414982.850080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414982.960247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414983.086835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414983.215546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414983.365809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414983.481284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414983.617628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414983.751145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414983.879650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414984.022507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414984.139781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414984.279812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414984.401199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414984.542742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414984.651589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414984.781632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414984.908569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414985.037052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414985.169471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414985.292706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414985.425636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414985.564692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414985.700172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414985.834044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414985.958029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414986.093726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414986.212101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414986.347754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414986.479910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414986.605269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414986.735847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414986.861987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414987.000056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414987.143087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414987.262053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414987.396783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414987.523122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414987.651440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414987.775901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414987.922796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414988.033175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414988.166821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414988.294393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414988.440453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414988.569757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414988.707538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414988.822386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414988.959448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414989.083894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414989.220925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414989.338563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414989.470846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414989.592476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414989.732363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414989.852129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414989.983644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414990.126787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414990.265398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414990.389641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414990.522271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414990.646355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414990.780288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414990.904652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414991.060556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414991.169428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414991.308575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414991.423169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414991.579715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414991.696637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414991.836138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414991.962945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414992.086572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414992.218379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414992.346278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414992.486470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414992.599289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414992.729746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414992.854920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414992.986874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414993.139284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414993.275862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414993.396876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414993.514634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414993.659979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414993.773089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414993.903752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414994.029364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414994.161854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414994.284142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414994.426680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414994.564421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414994.692950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414994.844060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414994.959636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414995.082659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414995.213744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414995.330401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414995.462544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414995.578804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414995.714183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414995.836595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414995.968129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414996.092614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414996.219525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414996.346795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414996.477620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414996.606720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414996.742853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414996.864614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414997.001744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414997.140419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638414997.271400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414997.397919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414997.523168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414997.656703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414997.791717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414997.913433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414998.040246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414998.167144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414998.312752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414998.435511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414998.583023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414998.709484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414998.836252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414998.963522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414999.092485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414999.214004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414999.348022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414999.468475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414999.595285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414999.727641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638414999.884844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415000.004749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415000.141006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415000.259057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415000.410071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415000.512402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415000.655656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415000.776195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415000.902292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415001.029910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415001.158648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415001.289887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415001.429005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415001.547171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415001.684093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415001.817215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415001.965130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415002.092118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415002.213256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415002.333735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415002.463025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415002.590371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415002.717627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415002.845093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415003.012474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415003.138245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415003.267123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415003.391300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415003.519024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415003.645103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415003.776364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415003.937308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415004.072902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415004.195530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415004.328431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415004.451592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415004.588514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415004.701452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415004.829111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415004.954763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415005.083049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415005.199425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415005.320366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415005.455901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415005.598130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415005.702327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415005.831530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415005.952107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415006.082814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415006.213835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415006.343169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415006.475386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415006.589784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415006.716542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415006.886059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415007.049154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415007.187300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415007.315791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415007.440441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415007.575060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415007.708323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415007.835677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415007.976193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415008.111910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415008.250842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415008.372046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415008.503424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415008.639878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415008.769557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415008.893820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415009.025621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415009.151830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415009.284694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415009.406984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415009.543091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415009.667970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415009.803537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415009.933754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415010.067893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415010.209241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415010.337291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415010.458974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415010.583931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415010.710767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415010.840411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415010.970731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415011.095455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415011.235741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415011.377050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415011.495721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415011.635994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415011.769187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415011.894694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415012.016782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415012.147391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415012.264959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415012.419023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415012.530988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415012.665363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415012.798710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415012.940603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415013.066570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415013.200918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415013.328372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415013.462368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415013.602791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415013.713918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415013.847470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415013.977060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415014.108768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415014.241477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415014.376052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415014.514693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415014.645335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415014.778184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415014.900795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415015.028432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415015.151885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415015.284446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415015.415058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415015.569804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415015.835892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415016.200692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415016.580666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415017.084904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415017.403961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415017.690092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415017.835605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415018.028864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415018.216025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415018.471107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415018.710836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415018.913770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415019.065835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415019.309444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415019.433837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415019.597802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415019.775782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415019.960549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415020.152675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415020.295585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415020.479757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415020.649586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415020.838377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415021.039290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415021.210765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415021.357178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415021.579041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415021.717878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415021.902371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415022.088985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415022.313872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415022.491707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415022.688615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415022.839802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415023.020180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415023.173942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415023.334151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415023.504863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415023.672710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415023.948176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415024.207149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415024.381095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415024.523993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415024.651498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415024.774691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415024.956386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415025.197736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415025.397621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415025.620030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415025.916570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415026.207236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415026.355932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415026.528203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415026.726587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415026.908291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415027.043420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415027.258049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415027.461614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415027.664877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415027.910159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415028.087567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415028.248732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415028.441100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415028.644689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415028.919853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415029.190453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415029.343133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415029.564906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415029.697576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415029.829004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415029.960835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415030.104286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415030.212111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415030.335291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415030.475015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415030.604354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415030.731323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415030.875874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415031.011698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415031.159586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415031.271521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415031.398267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415031.526766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415031.673088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415031.807757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415031.963545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415032.185874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415032.308014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415032.448050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415032.591675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415032.716112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415032.849736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415032.998632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415033.123553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415033.259732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415033.379376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415033.505857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415033.634500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415033.788969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415033.896710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415034.020932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415034.146692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415034.287781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415034.396733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415034.529521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415034.653553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415034.789420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415034.914843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415035.060736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415035.185140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415035.326008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415035.453262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415035.602021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415035.719308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415035.836059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415035.981478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415036.104088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415036.228600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415036.355639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415036.487910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415036.628082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415036.757718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415036.891285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415037.012200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415037.153250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415037.281056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415037.409835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415037.552752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415037.670346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415037.803859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415037.925044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415038.069696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415038.201281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415038.320634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415038.452496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415038.584022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415038.713342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415038.833782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415038.960582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415039.079494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415039.214655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415039.334372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415039.468260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415039.592002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415039.728669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415039.858417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415039.980653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415040.119432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415040.261704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415040.395118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415040.522735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415040.645360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415040.772856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415040.896055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415041.028946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415041.147130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415041.273121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415041.401509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415041.547596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415041.670981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415041.812940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415041.926253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415042.066512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415042.202020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415042.328860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415042.463831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415042.585065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415042.703476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415042.832820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415042.959033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415043.088620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415043.212545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415043.337839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415043.464181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415043.592715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415043.716973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415043.849979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415043.976178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415044.113211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415044.253920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415044.392627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415044.514417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415044.658085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415044.762961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415044.895319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415045.034698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415045.155659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415045.286436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415045.425055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415045.537746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415045.672774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415045.810222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415045.947112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415046.076196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415046.204451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415046.334059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415046.453210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415046.596088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415046.714947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415046.836751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415046.964796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415047.105317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415047.234339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415047.353897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415047.487237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415047.619384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415047.750986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415047.883258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415048.020143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415048.142620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415048.275620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415048.399928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415048.528166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415048.652485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415048.789085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415048.935705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415049.063315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415049.185538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415049.338155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415049.450620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415049.585135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415049.708281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415049.827384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415049.958125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415050.090606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415050.212625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415050.351317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415050.473845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415050.603221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415050.726014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415050.872144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415050.999032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415051.145136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415051.271778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415051.403811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415051.532290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415051.672339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415051.786610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415051.922825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415052.046141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415052.184401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415052.333032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415052.475684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415052.594121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415052.730148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415052.854427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415052.985936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415053.125793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415053.269211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415053.388181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415053.532783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415053.646186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415053.778167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415053.898363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415054.018550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415054.169255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415054.314027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415054.439837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415054.579842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415054.698488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415054.834174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415054.959078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415055.099817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415055.225094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415055.338725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415055.462277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415055.586386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415055.724750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415055.840173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415055.966204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415056.095429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415056.227139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415056.354400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415056.498779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415056.629994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415056.752438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415056.890297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415057.018687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415057.142720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415057.265101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415057.386845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415057.522905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415057.652502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415057.771176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415057.903543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415058.027618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415058.171276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415058.277510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415058.402317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415058.544188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415058.685462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415058.809320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415058.944402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415059.069425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415059.200019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415059.328007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415059.461862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415059.600153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415059.707610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415059.837489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415059.967988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415060.094157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415060.228205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415060.350698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415060.498204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415060.626782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415060.750287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415060.888525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415061.005815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415061.140801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415061.276732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415061.401884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415061.526492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415061.650169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415061.779688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415061.939065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415062.061767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415062.187427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415062.318670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415062.457472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415062.602120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415062.710701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415062.832778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415062.981709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415063.129264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415063.240158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415063.395265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415063.504399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415063.642374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415063.770796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415063.906501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415064.044677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415064.162502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415064.293866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415064.415461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415064.555113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415064.699301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415064.814963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415064.953913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415065.075355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415065.207153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415065.335209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415065.463760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415065.586307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415065.712283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415065.842973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415065.954487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415066.080892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415066.206708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415066.337368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415066.465813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415066.586238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415066.721809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415066.844406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415066.961729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415067.164208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415067.289348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415067.415346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415067.557264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415067.685536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415067.818367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415067.965578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415068.088332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415068.212452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415068.340362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415068.470407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415068.602952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415068.741072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415068.871576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415069.010523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415069.145276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415069.275345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415069.382861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415069.524756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415069.643059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415069.776090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415069.897058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415070.043884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415070.151501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415070.272781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415070.408186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415070.539186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415070.689286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415070.815531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415070.951176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415071.075389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415071.209568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415071.339234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415071.460476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415071.588563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415071.713432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415071.833340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415071.977641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415072.091287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415072.227316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415072.366864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415072.466620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415072.590913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415072.729231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415072.865143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415072.997183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415073.127410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415073.267348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415073.396789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415073.523834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415073.645154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415073.765950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415073.896814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415074.028397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415074.162768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415074.287362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415074.438104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415074.561446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415074.702605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415074.839388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415074.960671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415075.077837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415075.209720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415075.340332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415075.459285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415075.590760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415075.726716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415075.879607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415076.018730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415076.146030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415076.279922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415076.394121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415076.513621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415076.650676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415076.788752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415076.911440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415077.040325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415077.218534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415077.419741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415077.540779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415077.666101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415077.813903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415077.952394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415078.071637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415078.200618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415078.328861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415078.462693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415078.586404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415078.720519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415078.841638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415078.998048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415079.108775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415079.242958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415079.377824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415079.518544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415079.660309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415079.774810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415079.901064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415080.030455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415080.156050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415080.281587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415080.416008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415080.533976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415080.674191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415080.807143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415080.921330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415081.055637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415081.200090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415081.332033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415081.452760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415081.585147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415081.703802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415081.837901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415081.973005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415082.092288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415082.227172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415082.358513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415082.475129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415082.619423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415082.749846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415082.882117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415083.015976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415083.144926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415083.272183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415083.398778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415083.520856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415083.646146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415083.773232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415083.914232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415084.037045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415084.148883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415084.277232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415084.410525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415084.537216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415084.672087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415084.808857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415084.940520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415085.077283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415085.204296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415085.350428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415085.465371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415085.592226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415085.720169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415085.852744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415085.986496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415086.121692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415086.270079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415086.563599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415086.685968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415086.822726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415086.945983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415087.092800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415087.212734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415087.345534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415087.464581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415087.597719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415087.716172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415087.853021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415087.975352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415088.128250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415088.252561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415088.394161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415088.513547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415088.640652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415088.776912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415088.901562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415089.042159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415089.167332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415089.279704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415089.407483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415089.541277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415089.681288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415089.810157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415089.939149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415090.079336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415090.207086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415090.351151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415090.457604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415090.598803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415090.707064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415090.825502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415090.967242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415091.087192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415091.221425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415091.337621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415091.469167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415091.599972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415091.745246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415091.900525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415092.027358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415092.153089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415092.282144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415092.418499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415092.564845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415092.704623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415092.829669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415092.957050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415093.084728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415093.212044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415093.336659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415093.461215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415093.590742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415093.716317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415093.849787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415093.979973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415094.123634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415094.254875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415094.398651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415094.520502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415094.651790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415094.768702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415094.895061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415095.024202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415095.152125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415095.278397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415095.402999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415095.536520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415095.665179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415095.799272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415095.936811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415096.090775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415096.209816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415096.335043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415096.463343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415096.584616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415096.716360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415096.848035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415096.964243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415097.087453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415097.213547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415097.342876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415097.482030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415097.595105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415097.724401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415097.854386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415097.990488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415098.111780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415098.244760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415098.381317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415098.535625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415098.675901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415098.813061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415098.933196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415099.077888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415099.195203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415099.342854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415099.457299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415099.592475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415099.705362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415099.839284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415099.974840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415100.117494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415100.254224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415100.390602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415100.519283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415100.644157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415100.764750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415100.888157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415101.007590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415101.149054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415101.266603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415101.387949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415101.516780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415101.648932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415101.771015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415101.899114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415102.030261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415102.151259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415102.301784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415102.436440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415102.552949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415102.701071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415102.819424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415102.955195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415103.079473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415103.207176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415103.334590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415103.462974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415103.583161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415103.724010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415103.852574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415103.981765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415104.112031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415104.266899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415104.382836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415104.514167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415104.647343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415104.773589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415104.895523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415105.020902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415105.159462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415105.276243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415105.403240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415105.539610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415105.662153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415105.794575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415105.936876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415106.056217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415106.191466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415106.331266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415106.450005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415106.581149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415106.710250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415106.846190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415106.967057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415107.098827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415107.226362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415107.372981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415107.500503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415107.633159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415107.762538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415107.883404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415108.008007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415108.141045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415108.311773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415108.439470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415108.563531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415108.691072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415108.823484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415108.958995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415109.099838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415109.209599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415109.331221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415109.457772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415109.585829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415109.714724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415109.837034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415109.961522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415110.089122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415110.226221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415110.354756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415110.493862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415110.627005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415110.765059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415110.888588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415111.014782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415111.163325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415111.288298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415111.398103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415111.526741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415111.649360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415111.778841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415111.912770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415112.041238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415112.177683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415112.320932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415112.441981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415112.579355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415112.702404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415112.834145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415112.957091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415113.085198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415113.209006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415113.342217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415113.458221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415113.606266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415113.717646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415113.851450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415113.985632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415114.109937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415114.247638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415114.393239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415114.508029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415114.645135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415114.770559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415114.900010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415115.019806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415115.148986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415115.285038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415115.405012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415115.526279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415115.655578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415115.785185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415115.921118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415116.058306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415116.178712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415116.308886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415116.447801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415116.567908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415116.708994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415116.833374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415116.961251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415117.076912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415117.209692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415117.346858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415117.459406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415117.586495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415117.723690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415117.843745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415117.975832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415118.115510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415118.245686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415118.372506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415118.516047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415118.639487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415118.773918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415118.896207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415119.021910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415119.146251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415119.288827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415119.416589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415119.556961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415119.671052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415119.831073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415119.965965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415120.123267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415120.233716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415120.367643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415120.498866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415120.636039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415120.761544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415120.911705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415121.015707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415121.137680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415121.274318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415121.427253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415121.526504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415121.667001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415121.781437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415121.955352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415122.082329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415122.204551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415122.327241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415122.474873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415122.576519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415122.700342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415122.828503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415122.960524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415123.082873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415123.211748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415123.330005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415123.461776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415123.583065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415123.725921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415123.871444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415123.996907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415124.131489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415124.266739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415124.388699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415124.520151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415124.656862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415124.772855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415124.891926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415125.024405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415125.161144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415125.275375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415125.398406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415125.529074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415125.651760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415125.789201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415125.912671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415126.038812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415126.177272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415126.312025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415126.447846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415126.592365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415126.701452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415126.825438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415126.962185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415127.154258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415127.279261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415127.420355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415127.545838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415127.691426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415127.824168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415127.958960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415128.074591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415128.210721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415128.334882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415128.467461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415128.589618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415128.724621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415128.851243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415128.997010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415129.115479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415129.276324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415129.397005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415129.536448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415129.642315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415129.776550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415129.893354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415130.040271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415130.147777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415130.290823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415130.410416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415130.535117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415130.650089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415130.769166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415130.900925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415131.053625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415131.153941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415131.286387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415131.435081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415131.568603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415131.680864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415131.812800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415131.940268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415132.084324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415132.201069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415132.331550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415132.455798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415132.584188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415132.704470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415132.836825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415132.990755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415133.119846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415133.257728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415133.391056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415133.510819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415133.636930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415133.769598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415133.906520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415134.018867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415134.147535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415134.275923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415134.412312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415134.526687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415134.661157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415134.789604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415134.928140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415135.066098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415135.212157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415135.322956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415135.461266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415135.581973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415135.710778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415135.847943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415135.976830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415136.105033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415136.228083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415136.383192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415136.507572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415136.641832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415136.773227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415136.909182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415137.028495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415137.162662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415137.280064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415137.404083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415137.539696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415137.681635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415137.810281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415137.928768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415138.064034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415138.197207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415138.331922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415138.446923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415138.580167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415138.717097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415138.831839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415138.959005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415139.090994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415139.211167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415139.354003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415139.479013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415139.596831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415139.727887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415139.871241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415140.007240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415140.138947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415140.265227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415140.388468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415140.509558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415140.659905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415140.766269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415140.904941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415141.018808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415141.149028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415141.272752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415141.402734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415141.545058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415141.665325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415141.813185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415141.938277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415142.075627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415142.205527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415142.322889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415142.449351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415142.570227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415142.694608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415142.823601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415142.961615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415143.084011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415143.208385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415143.332476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415143.454360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415143.575571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415143.715205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415143.836395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415143.968017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415144.085727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415144.222142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415144.352843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415144.475247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415144.616554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415144.750636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415144.873907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415145.006994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415145.139712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415145.264837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415145.392193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415145.525140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415145.650653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415145.776500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415145.911891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415146.025494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415146.164539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415146.292453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415146.404034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415146.538411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415146.659108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415146.794410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415146.928430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415147.065237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415147.197228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415147.326915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415147.461680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415147.588945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415147.716467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415147.849237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415147.994227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415148.129073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415148.248127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415148.368951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415148.492063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415148.630008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415148.752834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415148.895288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415149.019726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415149.151617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415149.291708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415149.409077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415149.553920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415149.682520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415149.813287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415149.950822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415150.079066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415150.203310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415150.330199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415150.456134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415150.581163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415150.710786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415150.849123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415150.966481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415151.101169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415151.225838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415151.346825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415151.497925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415151.625876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415151.749621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415151.901711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415152.038395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415152.163885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415152.278411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415152.412536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415152.560462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415152.688796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415152.836107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415152.950133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415153.079514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415153.205629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415153.334122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415153.457135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415153.578403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415153.700155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415153.842643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415153.967609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415154.103018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415154.251143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415154.385810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415154.503548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415154.643666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415154.759955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415154.896876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415155.012429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415155.146725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415155.266600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415155.398898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415155.521135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415155.651458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415155.774852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415155.908670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415156.037728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415156.180164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415156.313303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415156.451926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415156.577685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415156.711697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415156.832260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415156.962812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415157.083269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415157.210512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415157.346287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415157.479434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415157.590706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415157.722045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415157.850584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415157.974431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415158.092589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415158.224920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415158.369146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415158.485195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415158.627936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415158.763861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415158.899047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415159.009921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415159.134006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415159.278554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415159.385713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415159.513337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415159.643770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415159.767958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415159.901151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415160.031100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415160.165367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415160.302689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415160.432980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415160.576971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415160.700488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415160.833895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415160.953580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415161.082067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415161.205364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415161.332098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415161.458918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415161.584396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415161.706444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415161.833902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415161.955645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415162.098798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415162.209319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415162.339671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415162.465257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415162.590844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415162.721272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415162.856254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415162.983930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415163.110741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415163.249200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415163.378526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415163.508862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415163.641651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415163.765264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415163.896076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415164.020432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415164.146318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415164.270197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415164.400855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415164.534400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415164.654843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415164.785821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415164.926985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415165.062082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415165.195525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415165.315784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415165.463031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415165.575705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415165.693949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415165.829025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415165.959229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415166.080697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415166.208421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415166.335281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415166.466842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415166.602706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415166.726511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415166.865223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415166.983046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415167.124005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415167.257631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415167.387923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415167.515140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415167.641752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415167.761000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415167.882209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415168.011078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415168.137934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415168.283901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415168.392563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415168.509543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415168.643849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415168.772380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415168.903224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415169.044064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415169.152180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415169.300498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415169.558806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415169.888348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415170.228206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415170.498921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415170.826758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415171.208642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415171.474587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415171.697929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415171.868622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415172.090977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415172.268124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415172.464732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415172.661313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415172.857013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415172.998775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415173.152288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415173.312052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415173.479761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415173.675436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415173.850178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415173.970954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415174.141176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415174.323517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415174.514836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415174.687323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415174.884300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415175.039713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415175.195645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415175.383202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415175.518334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415175.667320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415175.834755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415176.022283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415176.274318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415176.445829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415176.603708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415176.771619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415176.934476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415177.078398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415177.233948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415177.401151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415177.630161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415177.953336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415178.134185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415178.265766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415178.399683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415178.539337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415178.689745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415178.835247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415179.018812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415179.197718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415179.363900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415179.533657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415179.712339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415179.909927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415180.102397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415180.283772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415180.412062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415180.586984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415180.789520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415180.948573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415181.113092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415181.289215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415181.459546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415181.626886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415181.821364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415182.021449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415182.201069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415182.375828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415182.669208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415182.939283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415183.085734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415183.225625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415183.349836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415183.492666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415183.627609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415183.751241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415183.891243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415184.027931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415184.172255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415184.299214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415184.431260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415184.563002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415184.716274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415184.835377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415184.948908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415185.084403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415185.200260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415185.327543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415185.479784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415185.703444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415185.834129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415185.961529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415186.086023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415186.244020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415186.349552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415186.481047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415186.621592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415186.755600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415186.876482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415187.018150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415187.135440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415187.265835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415187.391577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415187.525842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415187.640144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415187.774314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415187.908016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415188.036054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415188.165424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415188.296298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415188.437159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415188.575500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415188.693973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415188.824302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415188.964880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415189.078890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415189.222744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415189.347831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415189.461714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415189.582024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415189.712547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415189.838537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415189.967724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415190.101706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415190.228686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415190.364414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415190.503266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415190.628862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415190.771908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415190.903225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415191.025704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415191.158984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415191.288058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415191.421009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415191.546933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415191.695701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415191.826289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415191.958283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415192.078262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415192.200368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415192.322443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415192.460417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415192.591308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415192.716228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415192.841446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415192.973343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415193.105741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415193.242906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415193.370615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415193.503461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415193.632110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415193.763872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415193.892655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415194.018991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415194.140555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415194.269165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415194.395954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415194.525233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415194.665373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415194.789863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415194.937140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415195.054740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415195.185302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415195.315637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415195.455426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415195.583896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415195.694509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415195.823681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415195.967031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415196.104717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415196.234057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415196.382708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415196.512092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415196.644475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415196.765238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415196.895932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415197.032388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415197.150913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415197.274614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415197.402275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415197.547738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415197.695184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415197.817058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415197.945475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415198.077161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415198.212911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415198.335803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415198.466289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415198.588698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415198.725354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415198.854996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415198.988947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415199.117249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415199.252828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415199.392379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415199.507735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415199.635553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415199.759173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415199.890546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415200.021850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415200.143198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415200.270899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415200.405523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415200.522477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415200.643462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415200.775855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415200.900724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415201.037756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415201.180143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415201.309001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415201.437749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415201.565367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415201.695356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415201.827124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415201.960610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415202.086993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415202.213323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415202.350082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415202.489966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415202.620891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415202.752345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415202.884842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415203.014631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415203.130941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415203.258084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415203.392370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415203.506013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415203.648494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415203.772727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415203.928802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415204.040365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415204.189041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415204.302721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415204.443277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415204.568953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415204.699111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415204.821713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415204.957610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415205.081574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415205.207172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415205.327338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415205.458474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415205.579770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415205.709080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415205.834146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415205.977589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415206.090378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415206.223443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415206.352144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415206.497716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415206.626249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415206.780438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415206.891298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415207.021479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415207.161324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415207.272028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415207.397682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415207.524881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415207.661074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415207.795932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415207.927768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415208.056013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415208.173994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415208.323130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415208.442318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415208.573787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415208.700614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415208.852310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415208.963467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415209.087102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415209.213585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415209.347473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415209.480297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415209.601329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415209.748336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415209.887345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415210.015837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415210.143244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415210.281951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415210.403481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415210.515630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415210.641145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415210.775492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415210.903425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415211.032579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415211.193842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415211.351055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415211.489788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415211.607167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415211.748684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415211.894096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415212.024056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415212.149185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415212.274374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415212.397814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415212.523652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415212.653896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415212.807221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415212.919038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415213.058599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415213.186342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415213.328885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415213.456554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415213.580363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415213.707336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415213.863161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415213.976342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415214.114096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415214.247362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415214.384572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415214.503231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415214.632829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415214.759982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415214.891098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415215.014049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415215.142319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415215.265335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415215.395876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415215.522559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415215.651263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415215.774195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415215.910104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415216.032224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415216.176079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415216.300856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415216.448374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415216.571490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415216.694407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415216.810128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415216.944023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415217.077743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415217.202327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415217.321468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415217.456365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415217.577031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415217.706365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415217.821933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415217.951214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415218.078676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415218.200234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415218.328733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415218.456838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415218.579651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415218.715067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415218.857964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415218.973367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415219.103532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415219.241212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415219.369222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415219.499330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415219.636597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415219.762924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415219.891995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415220.018261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415220.163116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415220.276105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415220.402331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415220.527590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415220.649275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415220.795881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415220.919612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415221.041458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415221.182207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415221.310027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415221.437613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415221.572430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415221.704201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415221.844186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415221.948752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415222.081801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415222.211813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415222.339231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415222.463902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415222.619292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415222.728241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415222.868437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415222.994798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415223.129842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415223.254384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415223.388341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415223.506914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415223.640248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415223.783045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415223.920423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415224.063693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415224.199424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415224.325233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415224.446837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415224.575377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415224.722775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415224.827574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415224.956849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415225.079483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415225.222432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415225.323690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415225.466677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415225.575128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415225.707376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415225.837606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415225.962607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415226.087707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415226.226660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415226.361530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415226.497353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415226.632009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415226.765991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415226.885019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415227.017829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415227.138880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415227.272811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415227.390784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415227.521875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415227.650559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415227.784579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415227.904770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415228.057175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415228.166540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415228.308807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415228.435356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415228.567412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415228.696134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415228.832928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415228.955086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415229.081789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415229.223278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415229.335529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415229.461054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415229.588361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415229.716145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415229.884773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415230.013423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415230.140480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415230.262630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415230.390140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415230.515646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415230.643350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415230.766211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415230.901757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415231.090678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415231.243687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415231.357529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415231.503434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415231.632307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415231.778140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415231.892590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415232.039163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415232.150476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415232.287483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415232.424086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415232.557939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415232.693841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415232.832541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415232.963079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415233.083019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415233.210475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415233.340019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415233.460602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415233.599410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415233.719438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415233.850244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415233.980983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415234.126743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415234.254553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415234.386966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415234.514545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415234.646619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415234.767669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415234.909607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415235.034479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415235.149361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415235.287443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415235.403989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415235.524671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415235.661513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415235.803331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415235.932194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415236.064842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415236.208908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415236.322192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415236.470494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415236.582503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415236.712572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415236.834515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415236.972256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415237.100565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415237.231552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415237.369174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415237.517427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415237.655746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415237.766558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415237.888945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415238.025302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415238.144003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415238.282004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415238.410011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415238.549108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415238.674719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415238.814230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415238.942732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415239.076848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415239.198759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415239.334766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415239.457549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415239.585350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415239.713591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415239.864851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415240.010371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415240.130312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415240.260188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415240.390320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415240.518576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415240.646267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415240.768725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415240.894165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415241.018676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415241.180263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415241.287525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415241.439296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415241.570472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415241.707732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415241.837323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415241.991868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415242.136298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415242.282399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415242.390023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415242.521009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415242.645734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415242.784262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415242.909938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415243.036140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415243.169106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415243.290200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415243.426264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415243.574069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415243.706970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415243.837728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415243.973150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415244.136966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415244.257586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415244.388914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415244.509521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415244.645667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415244.764689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415244.894416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415245.022728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415245.148116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415245.265557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415245.399766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415245.526207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415245.654764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415245.787649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415245.918091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415246.052201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415246.189465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415246.318982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415246.463300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415246.578903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415246.703012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415246.834440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415246.989711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415247.098052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415247.221152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415247.346607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415247.487694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415247.626243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415247.765533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415247.894600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415248.025548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415248.147669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415248.290971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415248.409176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415248.535017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415248.672015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415248.790071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415248.929104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415249.076241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415249.202126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415249.324425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415249.445053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415249.586411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415249.704222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415249.835700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415249.976632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415250.100120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415250.235925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415250.377198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415250.506335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415250.644385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415250.758210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415250.886308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415251.020298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415251.151325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415251.272182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415251.406209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415251.539589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415251.667812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415251.809068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415251.934149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415252.066702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415252.200213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415252.322554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415252.455525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415252.602857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415252.713798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415252.835424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415252.964548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415253.096725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415253.220488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415253.354368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415253.475345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415253.634347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415253.752920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415253.887143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415254.015424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415254.144516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415254.266227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415254.394604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415254.518399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415254.638157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415254.768987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415254.886994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415255.018532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415255.139381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415255.270220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415255.399731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415255.537283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415255.674974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415255.832079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415255.962199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415256.096149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415256.222263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415256.370393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415256.497695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415256.623679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415256.762245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415256.896475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415257.021832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415257.154129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415257.283665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415257.423408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415257.548889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415257.694591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415257.813842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415257.957185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415258.076282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415258.207869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415258.331456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415258.476920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415258.581831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415258.719066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415258.849478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415259.005448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415259.141854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415259.262696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415259.391501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415259.522000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415259.650716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415259.788157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415259.910025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415260.038833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415260.170460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415260.320620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415260.450781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415260.592709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415260.699584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415260.832258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415260.950326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415261.083805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415261.206870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415261.336445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415261.465607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415261.612711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415261.743078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415261.877615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415262.009298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415262.151004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415262.258498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415262.392431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415262.523236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415262.660343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415262.778378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415262.912208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415263.048029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415263.181328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415263.307676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415263.440545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415263.568003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415263.699843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415263.833606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415263.951478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415264.086269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415264.211267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415264.333699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415264.466383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415264.589998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415264.718814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415264.849551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415264.998052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415265.116034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415265.249432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415265.395241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415265.532153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415265.640684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415265.772305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415265.889450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415266.020669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415266.140492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415266.285897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415266.411328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415266.555309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415266.681589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415266.818828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415266.939780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415267.077748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415267.201227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415267.327510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415267.452848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415267.580321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415267.706786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415267.834204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415267.972728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415268.097288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415268.228631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415268.373370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415268.517671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415268.639111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415268.761489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415268.895315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415269.017577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415269.153048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415269.273044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415269.413755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415269.540232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415269.663787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415269.803326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415269.931035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415270.065969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415270.206903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415270.323423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415270.456667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415270.575030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415270.710155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415270.833024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415270.970593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415271.097836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415271.228346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415271.352878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415271.498938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415271.615593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415271.751529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415271.907210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415272.036434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415272.157839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415272.305614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415272.439060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415272.587134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415272.700556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415272.830631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415272.948158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415273.087766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415273.204340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415273.324666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415273.462347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415273.619466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415273.739581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415273.874925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415274.000493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415274.138376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415274.264031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415274.386580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415274.528368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415274.643350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415274.768034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415274.897620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415275.020970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415275.157771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415275.272502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415275.401097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415275.532430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415275.668365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415275.803941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415275.937023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415276.064024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415276.189769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415276.315460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415276.448630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415276.570149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415276.701074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415276.832472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415276.962667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415277.085804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415277.208222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415277.332713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415277.465745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415277.596064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415277.734456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415277.871168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415277.998372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415278.130754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415278.268706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415278.383923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415278.516512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415278.648465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415278.802045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415278.906549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415279.042340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415279.177583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415279.303029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415279.433339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415279.579214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415279.701457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415279.836743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415279.957955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415280.084723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415280.220644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415280.348886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415280.479388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415280.612936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415280.759618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415280.881241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415281.014315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415281.136548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415281.266777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415281.389636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415281.510116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415281.642930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415281.766242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415281.889965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415282.015795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415282.141689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415282.273656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415282.397154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415282.530019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415282.675126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415282.821957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415282.929278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415283.070478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415283.205278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415283.340622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415283.449524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415283.576639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415283.700655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415283.827724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415283.959634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415284.096018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415284.211293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415284.342354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415284.469493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415284.598356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415284.735366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415284.870500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415285.040617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415285.189243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415285.310967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415285.451343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415285.578869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415285.705064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415285.831417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415285.962027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415286.086735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415286.207947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415286.345259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415286.471210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415286.590358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415286.722297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415286.846111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415286.971355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415287.109597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415287.242224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415287.377503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415287.509675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415287.640070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415287.768006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415287.895479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415288.018715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415288.159799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415288.268604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415288.393877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415288.537609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415288.664917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415288.782820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415288.930979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415289.056608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415289.201490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415289.343378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415289.458380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415289.580860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415289.708623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415289.829816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415289.967858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415290.085020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415290.227586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415290.345512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415290.490257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415290.600410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415290.730513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415290.863058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415290.998216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415291.138925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415291.268348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415291.392805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415291.519303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415291.640234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415291.781800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415291.903922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415292.020230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415292.158274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415292.270814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415292.405607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415292.533901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415292.655817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415292.783153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415292.928468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415293.061020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415293.188930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415293.339147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415293.455025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415293.590677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415293.706864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415293.838748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415293.962819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415294.088351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415294.217912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415294.358692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415294.487302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415294.604399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415294.743795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415294.880520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415295.010201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415295.158241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415295.265551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415295.389611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415295.519038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415295.649026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415295.770471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415295.908431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415296.023920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415296.158526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415296.289355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415296.433491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415296.556135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415296.698410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415296.825557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415296.950855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415297.095894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415297.209032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415297.331847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415297.482764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415297.599552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415297.741949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415297.869813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415298.005717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415298.124875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415298.257277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415298.383365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415298.517131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415298.646604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415298.767085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415298.890742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415299.021114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415299.157883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415299.273344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415299.400507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415299.532610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415299.656152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415299.799095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415299.942472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415300.071020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415300.201664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415300.333061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415300.454755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415300.584551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415300.710122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415300.840152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415300.966797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415301.118724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415301.244195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415301.384218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415301.511365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415301.665684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415301.767019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415301.930018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415302.058784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415302.190975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415302.320920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415302.449651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415302.571532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415302.704301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415302.832884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415302.983666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415303.085763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415303.217401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415303.365892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415303.493235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415303.628886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415303.763063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415303.898567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415304.041804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415304.166255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415304.305828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415304.419536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415304.548290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415304.682147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415304.814939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415304.951505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415305.077749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415305.204688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415305.348668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415305.463795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415305.583378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415305.716568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415305.854893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415306.002024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415306.138745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415306.257490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415306.404497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415306.510351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415306.655260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415306.760303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415306.894444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415307.032486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415307.142781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415307.271852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415307.414889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415307.524113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415307.648594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415307.779974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415307.937267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415308.062806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415308.191631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415308.321682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415308.452022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415308.593734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415308.705247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415308.825623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415308.950054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415309.071876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415309.207555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415309.331939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415309.495363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415309.747459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415310.072531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415310.494680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415310.779516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415311.160500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415311.434009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415311.649423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415311.877076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415312.066971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415312.283036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415312.541482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415312.698490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415312.859377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415313.077883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415313.256556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415313.408179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415313.586707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415313.780047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415313.933798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415314.100878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415314.271580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415314.450037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415314.659787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415314.802450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415314.947208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415315.147077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415315.321264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415315.510252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415315.663185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415315.923583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415316.052320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415316.251982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415316.514591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415316.685163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415316.836440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415317.034585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415317.186117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415317.326384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415317.512603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415317.676849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415317.842607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415318.168149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415318.370685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415318.530144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415318.656215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415318.812450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415318.946770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415319.093305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415319.271239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415319.445104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415319.618103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415319.775002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415319.948042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415320.140314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415320.303834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415320.475674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415320.664861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415320.829583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415321.029467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415321.157693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415321.351520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415321.571801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415321.715941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415321.925979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415322.087008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415322.255146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415322.450668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415322.594145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415322.810973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415323.140066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415323.381653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415323.541477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415323.692380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415323.807267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415323.966527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415324.068653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415324.199452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415324.328705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415324.456616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415324.583542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415324.697179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415324.832011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415324.955319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415325.088443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415325.203964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415325.330283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415325.467039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415325.589479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415325.722858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415325.898347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415326.112846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415326.233180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415326.367886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415326.502296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415326.639156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415326.759367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415326.893080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415327.021600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415327.156613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415327.262455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415327.394898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415327.529944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415327.652935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415327.769796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415327.891457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415328.024804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415328.147516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415328.273508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415328.403000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415328.528497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415328.677958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415328.796993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415328.939668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415329.063055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415329.212377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415329.322405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415329.459302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415329.570047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415329.694410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415329.825470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415329.956219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415330.077824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415330.200893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415330.321070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415330.451946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415330.587323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415330.717909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415330.841496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415330.953340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415331.087846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415331.222764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415331.346927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415331.488908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415331.629495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415331.763914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415331.912493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415332.048687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415332.175102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415332.310739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415332.447260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415332.571622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415332.694993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415332.824549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415332.948043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415333.080925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415333.211356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415333.342501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415333.456223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415333.585029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415333.707474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415333.844953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415333.976051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415334.108690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415334.244385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415334.383296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415334.504561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415334.638942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415334.751475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415334.881883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415335.002124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415335.132004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415335.258142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415335.398115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415335.514984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415335.659837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415335.775359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415335.942559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415336.056068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415336.202378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415336.323060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415336.457602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415336.569841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415336.704331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415336.826058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415336.955637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415337.078702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415337.221112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415337.328796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415337.454607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415337.583661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415337.716286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415337.832779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415337.963267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415338.085945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415338.220573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415338.350306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415338.485357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415338.619360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415338.758871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415338.878481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415339.010782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415339.131924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415339.272514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415339.397325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415339.521345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415339.651261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415339.782503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415339.929734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415340.054215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415340.182500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415340.324213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415340.444794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415340.574841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415340.700969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415340.830207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415340.953778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415341.081098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415341.202106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415341.333230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415341.455678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415341.583532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415341.714833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415341.834471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415341.958959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415342.095868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415342.217021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415342.344650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415342.507722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415342.622115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415342.749413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415342.888853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415343.006179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415343.133749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415343.266157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415343.393615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415343.512225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415343.645971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415343.765893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415343.893736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415344.025666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415344.178423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415344.306152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415344.442648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415344.559336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415344.686285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415344.818613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415344.948512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415345.070923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415345.205976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415345.335790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415345.459373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415345.586261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415345.741135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415345.849023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415345.987696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415346.118949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415346.251509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415346.381329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415346.517292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415346.640078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415346.761135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415346.890193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415347.024326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415347.146032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415347.274286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415347.402688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415347.532359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415347.658492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415347.791691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415347.939904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415348.052828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415348.193445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415348.329368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415348.453088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415348.580648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415348.719546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415348.840992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415348.956380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415349.092587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415349.219612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415349.360555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415349.491400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415349.617424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415349.748885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415349.877767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415350.011225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415350.152676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415350.277582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415350.398584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415350.528627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415350.665045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415350.785773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415350.910840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415351.060894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415351.202801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415351.320890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415351.452010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415351.579148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415351.701038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415351.823517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415351.960988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415352.093865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415352.198532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415352.324975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415352.455514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415352.579970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415352.715289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415352.845240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415352.989985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415353.103020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415353.238792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415353.374079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415353.488971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415353.625746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415353.752352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415353.885355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415354.013012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415354.141029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415354.266902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415354.392496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415354.524153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415354.646830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415354.785022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415354.925249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415355.066271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415355.193991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415355.323928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415355.442517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415355.588583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415355.695783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415355.828907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415355.948237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415356.076273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415356.204184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415356.345625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415356.462407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415356.601901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415356.739597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415356.891350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415357.005327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415357.153702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415357.263319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415357.383274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415357.504585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415357.639528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415357.763448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415357.895977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415358.022261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415358.174416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415358.284453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415358.419428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415358.549215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415358.691861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415358.824801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415358.966327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415359.088948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415359.219565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415359.360245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415359.488038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415359.613454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415359.743327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415359.899279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415360.018625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415360.145077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415360.279123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415360.418465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415360.540422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415360.681372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415360.824023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415360.948369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415361.078166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415361.203895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415361.336325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415361.460021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415361.600996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415361.739494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415361.900377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415362.049985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415362.163332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415362.308859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415362.433455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415362.563777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415362.711221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415362.815054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415362.953303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415363.076527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415363.199336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415363.321822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415363.451507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415363.579847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415363.702457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415363.841824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415363.970968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415364.117834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415364.237733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415364.370130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415364.494992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415364.621570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415364.750920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415364.879502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415365.011540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415365.135677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415365.266213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415365.396458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415365.526876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415365.648151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415365.775316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415365.894661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415366.031705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415366.163667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415366.311346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415366.425937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415366.565464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415366.690579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415366.833470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415367.013494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415367.157165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415367.264889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415367.400227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415367.523299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415367.650545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415367.787247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415367.931726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415368.062230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415368.199045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415368.317228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415368.452636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415368.587844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415368.703577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415368.827276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415368.966251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415369.084022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415369.209987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415369.334214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415369.488370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415369.596074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415369.736941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415369.864543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415370.007181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415370.137111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415370.273652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415370.391475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415370.519275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415370.644705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415370.770045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415370.893465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415371.029708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415371.176692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415371.378749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415371.509200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415371.647989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415371.780018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415371.931210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415372.052958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415372.199475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415372.326785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415372.460682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415372.593272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415372.695131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415372.828036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415372.955065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415373.083371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415373.214125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415373.346496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415373.475941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415373.600939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415373.750100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415373.881453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415374.005136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415374.134317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415374.264123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415374.387745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415374.518961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415374.650313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415374.774115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415374.893024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415375.024838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415375.145287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415375.280434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415375.412682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415375.554882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415375.675353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415375.817344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415375.954367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415376.092114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415376.216885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415376.357129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415376.491654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415376.631404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415376.756433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415376.888564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415377.015509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415377.137998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415377.269714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415377.397890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415377.516818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415377.654416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415377.779374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415377.902181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415378.038010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415378.164286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415378.287868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415378.427849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415378.563638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415378.694609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415378.820212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415378.947723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415379.075634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415379.217511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415379.330634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415379.453456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415379.584895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415379.721344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415379.841861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415379.991457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415380.118721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415380.254812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415380.376903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415380.529842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415380.633269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415380.758850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415380.892075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415381.020260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415381.140823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415381.277092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415381.407498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415381.551371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415381.682144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415381.832319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415381.948721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415382.078593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415382.205675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415382.334701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415382.465959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415382.600594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415382.733475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415382.866716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415382.993254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415383.122290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415383.271060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415383.394987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415383.516436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415383.644729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415383.766688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415383.896147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415384.022662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415384.154951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415384.285977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415384.431835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415384.552945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415384.693334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415384.820637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415384.950490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415385.074368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415385.205703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415385.329020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415385.450280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415385.577271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415385.709971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415385.846082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415385.982845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415386.109144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415386.272934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415386.584481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415386.818055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415387.017369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415387.143530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415387.277113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415387.394140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415387.519326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415387.650597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415387.784085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415387.920588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415388.067705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415388.197171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415388.319839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415388.442873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415388.574735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415388.703596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415388.829452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415388.955414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415389.083543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415389.214564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415389.342431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415389.468996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415389.606811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415389.755263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415389.886388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415390.010306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415390.136273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415390.270749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415390.391986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415390.530517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415390.660121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415390.799220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415390.902087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415391.065301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415391.177623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415391.312090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415391.435760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415391.570291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415391.698832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415391.824508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415391.965172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415392.142492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415392.261450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415392.394014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415392.519031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415392.652927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415392.777891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415392.906111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415393.027855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415393.163947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415393.284202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415393.414029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415393.555120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415393.687957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415393.818828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415393.952485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415394.075114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415394.211773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415394.330512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415394.477612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415394.611456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415394.742398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415394.871403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415395.010693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415395.131352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415395.257222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415395.387454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415395.515639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415395.645352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415395.780032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415395.890124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415396.018817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415396.143327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415396.280112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415396.424365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415396.581017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415396.698039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415396.822618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415396.940975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415397.080182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415397.201999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415397.329636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415397.453083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415397.585564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415397.706626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415397.841180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415397.964575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415398.092842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415398.233834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415398.367162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415398.523347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415398.633858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415398.761584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415398.884363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415399.010138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415399.146693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415399.268133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415399.403010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415399.532829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415399.679896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415399.802598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415399.940468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415400.063402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415400.198940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415400.320080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415400.450281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415400.573970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415400.704900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415400.820541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415400.951620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415401.076096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415401.206478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415401.344859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415401.456656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415401.591164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415401.720691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415401.843273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415401.987643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415402.115014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415402.253424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415402.370438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415402.506302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415402.623813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415402.760072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415402.890067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415403.012838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415403.138923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415403.262660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415403.387189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415403.511432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415403.638475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415403.770239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415403.903313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415404.029977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415404.156312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415404.286162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415404.425498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415404.591309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415404.697550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415404.839827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415404.950484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415405.076819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415405.197022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415405.346227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415405.449729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415405.575458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415405.702251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415405.860997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415405.965615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415406.109109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415406.240003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415406.384128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415406.513648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415406.636176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415406.762426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415406.890080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415407.010679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415407.162549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415407.266994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415407.390516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415407.519591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415407.637516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415407.761134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415407.891179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415408.026116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415408.145057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415408.270745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415408.402167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415408.526752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415408.683993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415408.789178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415408.926905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415409.062121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415409.186749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415409.320452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415409.458181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415409.572965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415409.703275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415409.825671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415409.957046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415410.075424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415410.205729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415410.327574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415410.457365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415410.582074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415410.716280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415410.862052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415410.990607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415411.116323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415411.253448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415411.378583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415411.514821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415411.634266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415411.755384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415411.891757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415412.020524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415412.142290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415412.270905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415412.396177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415412.530088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415412.656031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415412.796545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415412.935185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415413.070294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415413.185785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415413.327719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415413.454720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415413.593040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415413.720670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415413.841116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415413.972183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415414.107010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415414.248644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415414.377592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415414.502346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415414.637238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415414.763312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415414.898019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415415.019614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415415.154070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415415.276354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415415.412666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415415.549092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415415.679542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415415.813093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415415.949885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415416.071156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415416.195091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415416.321988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415416.445072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415416.577599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415416.709022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415416.843205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415416.963978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415417.096059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415417.240653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415417.375819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415417.506336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415417.632482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415417.761535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415417.885591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415418.017761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415418.138096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415418.277044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415418.412800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415418.553258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415418.692580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415418.830365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415418.949305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415419.072846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415419.194225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415419.323200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415419.449885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415419.576230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415419.687688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415419.820958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415419.972379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415420.082750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415420.213279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415420.341555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415420.469305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415420.614120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415420.742562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415420.882462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415421.001115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415421.138914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415421.265176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415421.411763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415421.528734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415421.667065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415421.785732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415421.922179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415422.082107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415422.215456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415422.343792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415422.470033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415422.608369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415422.736379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415422.886792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415423.018467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415423.131123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415423.252560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415423.375913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415423.499083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415423.625890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415423.760326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415423.904650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415424.025590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415424.151189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415424.293894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415424.427767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415424.553128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415424.695466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415424.806528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415424.922732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415425.071129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415425.201287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415425.322067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415425.446568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415425.567801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415425.698814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415425.825598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415425.955552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415426.092670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415426.226285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415426.383291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415426.491987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415426.620756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415426.752970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415426.884084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415427.010089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415427.155449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415427.262526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415427.405970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415427.618491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415427.738740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415427.888940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415428.009070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415428.143659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415428.259390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415428.388874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415428.518305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415428.650287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415428.780149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415428.908798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415429.051231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415429.193835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415429.319520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415429.450433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415429.571319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415429.705595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415429.835615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415429.969986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415430.098280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415430.239952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415430.368645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415430.508210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415430.631585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415430.759981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415430.884396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415431.015181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415431.142609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415431.267966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415431.431189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415431.562834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415431.690513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415431.834928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415431.956390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415432.081019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415432.205423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415432.337846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415432.463702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415432.595977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415432.724329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415432.864566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415432.996076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415433.117345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415433.257199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415433.382722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415433.504930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415433.633045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415433.777807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415433.890506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415434.013589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415434.155351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415434.261099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415434.395131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415434.513960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415434.639099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415434.760121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415434.887025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415435.013053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415435.146726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415435.268836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415435.398639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415435.540092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415435.676133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415435.805291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415435.953085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415436.077622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415436.214789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415436.338964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415436.473824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415436.614078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415436.751134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415436.888847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415437.011410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415437.140172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415437.259291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415437.385889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415437.522979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415437.635932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415437.761226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415437.904122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415438.016763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415438.144196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415438.270880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415438.393034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415438.526145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415438.646454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415438.787175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415438.909051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415439.052483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415439.176160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415439.339706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415439.458309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415439.591762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415439.739118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415439.864352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415440.003080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415440.146427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415440.277688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415440.396655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415440.518835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415440.663625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415440.783442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415440.924923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415441.054676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415441.195076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415441.307240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415441.442504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415441.569892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415441.701451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415441.826317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415441.966047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415442.093143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415442.210231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415442.362550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415442.491431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415442.628437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415442.760377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415442.885965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415443.012512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415443.135287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415443.266350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415443.387201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415443.512199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415443.628043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415443.762022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415443.893699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415444.024908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415444.142768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415444.278296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415444.397323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415444.536331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415444.652273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415444.799616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415444.924505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415445.057521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415445.173359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415445.310514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415445.442275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415445.571982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415445.683539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415445.817882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415445.944691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415446.073598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415446.199029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415446.322819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415446.445599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415446.573902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415446.693093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415446.829056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415446.949541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415447.080488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415447.200192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415447.331388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415447.461242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415447.592771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415447.726595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415447.865531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415448.019273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415448.154120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415448.263944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415448.406104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415448.541176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415448.671614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415448.809130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415448.934383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415449.059481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415449.198781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415449.319283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415449.451157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415449.573015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415449.699389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415449.837505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415449.951647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415450.080160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415450.242181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415450.443897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415450.732759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415451.117977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415451.528529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415451.983291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415452.256770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415452.437258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415452.643204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415452.847880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415453.028118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415453.258765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415453.451274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415453.638987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415453.822402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415454.007390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415454.181502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415454.338372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415454.513151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415454.712511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415454.877820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415455.082939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415455.207148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415455.372257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415455.538028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415455.718397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415455.949246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415456.083300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415456.269180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415456.425071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415456.617898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415456.778438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415456.923808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415457.094454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415457.319951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415457.520056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415457.692958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415457.859536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415458.022541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415458.156952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415458.340564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415458.508910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415458.659780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415458.823378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415459.099672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415459.355928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415459.509923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415459.639126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415459.789775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415459.926293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415460.060090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415460.217100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415460.403239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415460.586442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415460.743975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415460.901958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415461.084292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415461.249211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415461.464999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415461.620549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415461.798686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415461.954549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415462.134176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415462.302454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415462.488386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415462.641846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415462.804051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415462.993104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415463.153039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415463.323261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415463.528148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415463.711315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415463.841119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415464.141931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415464.412807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415464.593081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415464.725753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415464.860412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415465.005668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415465.125635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415465.250619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415465.382110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415465.508897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415465.628802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415465.760045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415465.886956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415466.026681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415466.154828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415466.288046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415466.428778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415466.592068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415466.697248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415466.822370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415466.965425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415467.184154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415467.343187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415467.481068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415467.603380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415467.747118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415467.880316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415468.009346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415468.134104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415468.260819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415468.389128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415468.514979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415468.642514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415468.777781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415468.894264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415469.044649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415469.176136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415469.315742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415469.443896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415469.574303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415469.699957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415469.831108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415469.947420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415470.073082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415470.213344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415470.330078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415470.446355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415470.576896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415470.702300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415470.837808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415470.975174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415471.100428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415471.249680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415471.378733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415471.495608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415471.633497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415471.769980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415471.885814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415472.019686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415472.140622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415472.295431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415472.429412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415472.576977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415472.714488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415472.829928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415472.947706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415473.075574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415473.205476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415473.326418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415473.473166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415473.579753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415473.707649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415473.835022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415473.985317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415474.125177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415474.261010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415474.371386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415474.501106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415474.628399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415474.763990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415474.898354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415475.018478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415475.175444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415475.300560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415475.453452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415475.582182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415475.700447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415475.822630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415475.953527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415476.089656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415476.200757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415476.328889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415476.468349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415476.613753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415476.743748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415476.884613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415477.004836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415477.136377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415477.270697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415477.415071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415477.524169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415477.652847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415477.775840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415477.924745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415478.056604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415478.195377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415478.318909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415478.451220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415478.576784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415478.713077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415478.843408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415478.963814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415479.095497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415479.237261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415479.365123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415479.502879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415479.627311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415479.764898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415479.891053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415480.028363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415480.190602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415480.305127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415480.442423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415480.569936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415480.688415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415480.841801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415480.950557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415481.075062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415481.205550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415481.342789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415481.484691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415481.631006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415481.744765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415481.883369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415482.031706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415482.172153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415482.295675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415482.434176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415482.553993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415482.680079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415482.814710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415482.946228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415483.081336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415483.214790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415483.330316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415483.450641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415483.578390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415483.704653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415483.840459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415483.997030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415484.123045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415484.255815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415484.386787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415484.507714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415484.631952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415484.762259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415484.889990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415485.020271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415485.165174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415485.312052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415485.433706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415485.584282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415485.695939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415485.830079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415485.953845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415486.088980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415486.211169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415486.341046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415486.481279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415486.602768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415486.745290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415486.878146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415487.005179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415487.150627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415487.266785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415487.382922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415487.560982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415487.689766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415487.806310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415487.952960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415488.078886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415488.215740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415488.346617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415488.488310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415488.605592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415488.738018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415488.872141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415489.002066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415489.132131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415489.255938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415489.382125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415489.517421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415489.655925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415489.768738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415489.904062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415490.021809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415490.168205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415490.317855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415490.443629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415490.567589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415490.696403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415490.824141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415490.943338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415491.075089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415491.202269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415491.332867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415491.455565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415491.596653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415491.735426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415491.853548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415491.990732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415492.117594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415492.254130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415492.401342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415492.508531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415492.642149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415492.763194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415492.895674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415493.021588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415493.149179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415493.300900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415493.413756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415493.557720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415493.692326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415493.817078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415493.957942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415494.079771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415494.212964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415494.340765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415494.478150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415494.614538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415494.740928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415494.870785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415495.017753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415495.132101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415495.261947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415495.387764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415495.515365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415495.642694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415495.768144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415495.921211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415496.065634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415496.182581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415496.313536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415496.435700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415496.559646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415496.695224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415496.821309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415496.938872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415497.073707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415497.191298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415497.320498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415497.462329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415497.572716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415497.691129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415497.820692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415497.957581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415498.081980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415498.219024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415498.339045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415498.476965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415498.592772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415498.728249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415498.862163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415498.994349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415499.130624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415499.261129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415499.380422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415499.509274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415499.636530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415499.764324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415499.921349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415500.048203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415500.210179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415500.307089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415500.445053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415500.571038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415500.705055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415500.831633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415500.984545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415501.089782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415501.217502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415501.349497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415501.502214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415501.621515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415501.757830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415501.880790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415502.014474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415502.130889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415502.260570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415502.386215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415502.510005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415502.636904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415502.775215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415502.896590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415503.045982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415503.153250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415503.292935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415503.423738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415503.559860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415503.684493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415503.841462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415503.965942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415504.092496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415504.222708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415504.369494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415504.500394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415504.635963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415504.756105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415504.892209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415505.023147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415505.143585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415505.261347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415505.390476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415505.528116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415505.655903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415505.790832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415505.932624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415506.062415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415506.199888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415506.323558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415506.452082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415506.582079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415506.704872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415506.833629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415506.958841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415507.090643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415507.223933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415507.358367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415507.495404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415507.620766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415507.746166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415507.877645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415508.004133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415508.132669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415508.265297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415508.404410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415508.546321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415508.654736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415508.785430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415508.938228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415509.073192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415509.201299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415509.337659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415509.456833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415509.589088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415509.716140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415509.859207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415510.001138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415510.133502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415510.253973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415510.384072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415510.514339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415510.641836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415510.760187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415510.890517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415511.010942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415511.141311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415511.277125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415511.416020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415511.529278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415511.655970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415511.826772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415512.010944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415512.193690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415512.329752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415512.450905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415512.590184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415512.711333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415512.862309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415512.997555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415513.131536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415513.268927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415513.381337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415513.506206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415513.630884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415513.763767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415513.903770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415514.039693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415514.190640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415514.315381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415514.445516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415514.568657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415514.714844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415514.821285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415514.984155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415515.093812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415515.235415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415515.361901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415515.519633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415515.624772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415515.767616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415515.878366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415516.014924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415516.139141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415516.267804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415516.398744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415516.547928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415516.652181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415516.798508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415516.925928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415517.073701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415517.187465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415517.323991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415517.440607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415517.571346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415517.706671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415517.828322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415517.951127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415518.075058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415518.202394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415518.330097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415518.467569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415518.590271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415518.720418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415518.880724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415519.002958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415519.132264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415519.256307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415519.388582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415519.524981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415519.642769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415519.778547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415519.945355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415520.063159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415520.196615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415520.327506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415520.457043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415520.591672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415520.725068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415520.851940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415521.006437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415521.122173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415521.258305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415521.377997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415521.506831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415521.629544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415521.756358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415521.882043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415522.013125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415522.132007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415522.262862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415522.388730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415522.524700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415522.650655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415522.780610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415522.922857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415523.082550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415523.189348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415523.322140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415523.441697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415523.576071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415523.704457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415523.838331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415523.989056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415524.119146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415524.247335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415524.380226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415524.496958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415524.635597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415524.762933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415524.888023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415525.015646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415525.149501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415525.272863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415525.401825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415525.547017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415525.676473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415525.807733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415525.941292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415526.067767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415526.194770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415526.320080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415526.446270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415526.568564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415526.698129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415526.829594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415526.955478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415527.088536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415527.216649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415527.343870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415527.479948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415527.612027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415527.751053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415527.885566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415528.004682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415528.150006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415528.267073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415528.385658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415528.526376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415528.648199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415528.780081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415528.917025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415529.050167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415529.191715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415529.321575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415529.448026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415529.576112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415529.719145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415529.836829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415529.955703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415530.081485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415530.220061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415530.362337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415530.498485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415530.626495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415530.754389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415530.903374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415531.012818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415531.137562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415531.268093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415531.399584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415531.528214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415531.657727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415531.794968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415531.932063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415532.058845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415532.200594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415532.315468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415532.447873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415532.573940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415532.697737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415532.817618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415532.962872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415533.092360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415533.202329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415533.347022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415533.471534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415533.615302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415533.743805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415533.861948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415534.011106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415534.135561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415534.266523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415534.386278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415534.516461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415534.637292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415534.772217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415534.906074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415535.061136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415535.196559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415535.316229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415535.437163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415535.569575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415535.690206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415535.823271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415535.948507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415536.076264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415536.199550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415536.359511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415536.474607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415536.604366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415536.717225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415536.866616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415537.002706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415537.128611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415537.242546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415537.380713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415537.501002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415537.633868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415537.754854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415537.889778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415538.012437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415538.140664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415538.261650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415538.390112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415538.512782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415538.644334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415538.777892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415538.941476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415539.075929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415539.202734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415539.345610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415539.452518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415539.586680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415539.736001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415539.848742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415540.007611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415540.129007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415540.256043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415540.388368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415540.525620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415540.658547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415540.784827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415540.924662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415541.062994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415541.196483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415541.334624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415541.455416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415541.582206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415541.717716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415541.896802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415542.032695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415542.162359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415542.298041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415542.444718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415542.552044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415542.682023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415542.805700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415542.944129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415543.069305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415543.202799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415543.319398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415543.445172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415543.574245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415543.704799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415543.819735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415543.982516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415544.116510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415544.265002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415544.377050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415544.497886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415544.626468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415544.747532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415544.876316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415545.003399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415545.126686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415545.260703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415545.388824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415545.521923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415545.641891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415545.779124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415545.898907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415546.032749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415546.168860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415546.303798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415546.432486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415546.562673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415546.685424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415546.831398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415546.941875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415547.069478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415547.194293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415547.365248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415547.511262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415547.649648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415547.776126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415547.907817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415548.051764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415548.187372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415548.337918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415548.451182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415548.572479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415548.703109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415548.835709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415548.951796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415549.078319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415549.224743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415549.341726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415549.481050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415549.610794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415549.754893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415549.868401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415550.005096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415550.127771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415550.260086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415550.381067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415550.509612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415550.634651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415550.761834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415550.888126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415551.082459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415551.210975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415551.337111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415551.467065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415551.611173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415551.740617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415551.872132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415551.985772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415552.119886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415552.240213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415552.378765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415552.500952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415552.632824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415552.756852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415552.880428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415553.007783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415553.137770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415553.262090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415553.384876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415553.508997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415553.650681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415553.762673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415553.892149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415554.022919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415554.147407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415554.280139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415554.422700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415554.554576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415554.696804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415554.824404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415554.958361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415555.086344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415555.217218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415555.336891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415555.477059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415555.609028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415555.740838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415555.886889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415556.055655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415556.157869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415556.284602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415556.436935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415556.570064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415556.696938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415556.824810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415556.946451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415557.073674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415557.199752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415557.324556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415557.450452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415557.577894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415557.699934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415557.836246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415557.956563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415558.090851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415558.218646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415558.344066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415558.474383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415558.614509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415558.743633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415558.875770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415559.002779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415559.137978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415559.263105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415559.389965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415559.514227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415559.649367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415559.776519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415559.903981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415560.054308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415560.209250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415560.311746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415560.435761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415560.568892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415560.711346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415560.826131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415560.955372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415561.087417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415561.234684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415561.369428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415561.497197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415561.628081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415561.759657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415561.879523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415562.009503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415562.129445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415562.261316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415562.382349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415562.522903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415562.631185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415562.754193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415562.881894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415563.011472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415563.127140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415563.265023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415563.387336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415563.513654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415563.638227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415563.773486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415563.904969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415564.023868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415564.149796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415564.286846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415564.413797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415564.559667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415564.681157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415564.819861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415564.939774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415565.074458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415565.191876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415565.330094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415565.452967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415565.593051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415565.710981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415565.860369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415565.981592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415566.143886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415566.255013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415566.386319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415566.513520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415566.631028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415566.755223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415566.898991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415567.023415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415567.132534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415567.259058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415567.392450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415567.508995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415567.642931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415567.774546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415567.920974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415568.028702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415568.190995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415568.309875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415568.447351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415568.574971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415568.702126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415568.828313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415568.982427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415569.090742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415569.235482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415569.366075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415569.486269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415569.622040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415569.753912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415569.874452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415570.009133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415570.129524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415570.255189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415570.384810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415570.510695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415570.638028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415570.791320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415570.889823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415571.018746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415571.151756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415571.303990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415571.426232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415571.560780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415571.684131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415571.829942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415571.954439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415572.086852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415572.218220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415572.352174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415572.488528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415572.630655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415572.745898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415572.883418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415573.018711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415573.133794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415573.257548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415573.380551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415573.508456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415573.635391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415573.753936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415573.881556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415574.009352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415574.132093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415574.258244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415574.389277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415574.512916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415574.640330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415574.776887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415574.900323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415575.028136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415575.168846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415575.300120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415575.433265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415575.555306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415575.690195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415575.809424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415575.958223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415576.069834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415576.202742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415576.319292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415576.450877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415576.572615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415576.701326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415576.820863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415576.954485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415577.092187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415577.231201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415577.359542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415577.501337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415577.609602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415577.748811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415577.877262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415578.011150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415578.127885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415578.254802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415578.378543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415578.519269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415578.638731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415578.767698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415578.888067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415579.022340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415579.155692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415579.294408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415579.425942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415579.560793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415579.695981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415579.822894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415579.952495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415580.074997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415580.193822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415580.321193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415580.444734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415580.587896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415580.725655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415580.843749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415580.966044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415581.117513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415581.239807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415581.391380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415581.511547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415581.637001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415581.764478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415581.896494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415582.018920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415582.148583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415582.281591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415582.423882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415582.552973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415582.689079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415582.808599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415582.957763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415583.066797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415583.211443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415583.337240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415583.476759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415583.577335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415583.708559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415583.828057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415584.008023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415584.126976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415584.255050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415584.383594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415584.509479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415584.635824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415584.763154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415584.895964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415585.013543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415585.146604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415585.285175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415585.398382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415585.544788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415585.670741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415585.810965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415585.935303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415586.063099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415586.196261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415586.333570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415586.444732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415586.583129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415586.702285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415586.843253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415586.982060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415587.109942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415587.241648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415587.378141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415587.506447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415587.624566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415587.753929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415587.888819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415588.002625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415588.135987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415588.256951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415588.383080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415588.508701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415588.636129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415588.756253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415588.884755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415589.022007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415589.170613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415589.295429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415589.424352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415589.547314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415589.682033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415589.809725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415589.942344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415590.070531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415590.213282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415590.330554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415590.461772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415590.580521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415590.705870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415590.840537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415590.982803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415591.116256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415591.364434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415591.619886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415591.981562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415592.367393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415592.702296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415593.070006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415593.428494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415593.649176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415593.872308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415594.059147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415594.245066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415594.440264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415594.614938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415594.763501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415594.935338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415595.154984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415595.317828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415595.449435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415595.639040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415595.819037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415595.965007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415596.152417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415596.337321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415596.503879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415596.642679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415596.834909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415597.002103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415597.192299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415597.361689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415597.523693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415597.707782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415597.878171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415598.108430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415598.276787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415598.502504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415598.716344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415598.889108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415599.050467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415599.218974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415599.378806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415599.524964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415599.701957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415599.892048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415600.134497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415600.402386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415600.562780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415600.694179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415600.836007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415600.954508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415601.075751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415601.201281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415601.330459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415601.458941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415601.588758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415601.718630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415601.985033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415602.195624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415602.374376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415602.590414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415602.765668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415602.901696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415603.112402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415603.313595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415603.448138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415603.639504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415603.796220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415603.959075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415604.132030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415604.345737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415604.518152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415604.699459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415604.854423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415605.016545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415605.217663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415605.379476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415605.566427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415605.832490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415606.178869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415606.366136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415606.506695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415606.628598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415606.781245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415606.895295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415607.039791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415607.173154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415607.313512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415607.432255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415607.568810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415607.690256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415607.823886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415607.977457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415608.112378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415608.234888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415608.379894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415608.502038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415608.637745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415608.813147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415609.015553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415609.134632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415609.271122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415609.399903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415609.537556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415609.668474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415609.810998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415609.940102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415610.063195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415610.183306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415610.316289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415610.438087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415610.571292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415610.699921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415610.826671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415610.949556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415611.078368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415611.199592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415611.334122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415611.460523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415611.588470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415611.724088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415611.878360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415611.992148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415612.132465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415612.249630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415612.383408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415612.505456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415612.650728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415612.758453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415612.898172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415613.019582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415613.151106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415613.273460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415613.402781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415613.528811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415613.668062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415613.802777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415613.968769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415614.078427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415614.213604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415614.349461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415614.484478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415614.617111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415614.758025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415614.882602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415615.005921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415615.147274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415615.260148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415615.378238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415615.507321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415615.629446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415615.754947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415615.919970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415616.028807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415616.153502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415616.287117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415616.421362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415616.544291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415616.694281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415616.856735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415616.961750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415617.092586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415617.241508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415617.373621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415617.492558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415617.634119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415617.751765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415617.882789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415618.005271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415618.127700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415618.257942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415618.382323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415618.512516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415618.637856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415618.759860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415618.896314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415619.019964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415619.148170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415619.293264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415619.419966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415619.544370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415619.673000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415619.794355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415619.935951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415620.054995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415620.192704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415620.314563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415620.446384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415620.562571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415620.697732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415620.815721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415620.949320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415621.081866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415621.200000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415621.323722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415621.460912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415621.582947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415621.713422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415621.863469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415621.994175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415622.132639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415622.257149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415622.376499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415622.504236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415622.629420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415622.764519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415622.881016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415623.016026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415623.146323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415623.278885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415623.400772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415623.544234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415623.679064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415623.831466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415623.933656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415624.073794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415624.195709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415624.323164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415624.448521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415624.583490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415624.708163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415624.851950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415624.985351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415625.127937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415625.248693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415625.374210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415625.503203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415625.628697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415625.756300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415625.879099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415625.999372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415626.131169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415626.272921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415626.402408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415626.536934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415626.656260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415626.796676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415626.935304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415627.054238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415627.193726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415627.319840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415627.448598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415627.584687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415627.708167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415627.838458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415627.957876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415628.087244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415628.232195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415628.373636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415628.485025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415628.621775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415628.746589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415628.871149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415629.005966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415629.123872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415629.256456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415629.398100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415629.527024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415629.638692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415629.769746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415629.892141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415630.025911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415630.167482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415630.291286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415630.427221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415630.567716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415630.680556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415630.817649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415630.940311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415631.074789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415631.189238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415631.321468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415631.459207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415631.570107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415631.703152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415631.859651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415631.991175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415632.124786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415632.245840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415632.378691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415632.504024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415632.628878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415632.754044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415632.895176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415633.006383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415633.133115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415633.255760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415633.389973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415633.569089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415633.714281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415633.824426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415633.955018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415634.076853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415634.207393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415634.337610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415634.465304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415634.592015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415634.738790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415634.872204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415634.994146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415635.133802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415635.258711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415635.384764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415635.514623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415635.652856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415635.792491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415635.922794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415636.058498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415636.173527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415636.310436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415636.435617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415636.561289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415636.680494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415636.822155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415636.940034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415637.072047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415637.193289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415637.323535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415637.443354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415637.576210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415637.696704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415637.825641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415637.948586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415638.075818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415638.204049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415638.337906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415638.463700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415638.607038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415638.737122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415638.860424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415639.013304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415639.139862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415639.245592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415639.383313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415639.507096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415639.637349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415639.761947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415639.910337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415640.032650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415640.164984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415640.296788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415640.423392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415640.564109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415640.691144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415640.814748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415640.943516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415641.064781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415641.195032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415641.313049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415641.444001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415641.558882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415641.714044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415641.812449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415641.954659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415642.074509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415642.209008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415642.337871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415642.464950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415642.604888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415642.742150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415642.863666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415642.992708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415643.113474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415643.256668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415643.382785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415643.508151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415643.645488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415643.796243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415643.902386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415644.043794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415644.176960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415644.322254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415644.437987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415644.588340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415644.693851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415644.832091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415644.965755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415645.084305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415645.213596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415645.345205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415645.482740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415645.621497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415645.748200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415645.885618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415646.011030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415646.151188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415646.270566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415646.419914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415646.537568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415646.680272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415646.799471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415646.950304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415647.076991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415647.206333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415647.327202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415647.460780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415647.584208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415647.723673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415647.843960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415647.985914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415648.115667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415648.251422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415648.375105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415648.504103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415648.633738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415648.771775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415648.896674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415649.016346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415649.134766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415649.261661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415649.394742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415649.540375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415649.650767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415649.793857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415649.918967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415650.078695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415650.183019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415650.326307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415650.429009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415650.561877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415650.693533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415650.821177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415650.948374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415651.078419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415651.213295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415651.353423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415651.479265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415651.612177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415651.754707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415651.884577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415652.005993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415652.140595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415652.270912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415652.403840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415652.534113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415652.674372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415652.795108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415652.922392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415653.121647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415653.309797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415653.431115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415653.567698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415653.698557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415653.817559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415653.952643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415654.078131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415654.199333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415654.340190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415654.484460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415654.632892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415654.751228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415654.883094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415655.012978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415655.140190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415655.269934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415655.410221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415655.540521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415655.682026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415655.806791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415655.940698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415656.068000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415656.195187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415656.327838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415656.454346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415656.578625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415656.708439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415656.857879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415656.986016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415657.122387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415657.250883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415657.378733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415657.524266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415657.629541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415657.770147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415657.888728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415658.029755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415658.145132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415658.290417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415658.424508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415658.558757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415658.684770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415658.816902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415658.940603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415659.069757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415659.197874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415659.358043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415659.480365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415659.622089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415659.745276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415659.873014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415660.009060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415660.143195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415660.261157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415660.393010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415660.510433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415660.640105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415660.774723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415660.907729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415661.050620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415661.194890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415661.321850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415661.456987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415661.578718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415661.717106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415661.860381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415662.006922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415662.127970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415662.272970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415662.398417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415662.521061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415662.646375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415662.780938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415662.896048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415663.049248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415663.171564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415663.297034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415663.421163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415663.567443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415663.684855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415663.821468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415663.953280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415664.086885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415664.222292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415664.373506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415664.496974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415664.625589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415664.745485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415664.891594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415665.001319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415665.134852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415665.257221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415665.382867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415665.507859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415665.673071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415665.785959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415665.923574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415666.057959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415666.201887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415666.312851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415666.422623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415666.564522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415666.694453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415666.816852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415666.962324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415667.066879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415667.203069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415667.323812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415667.452409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415667.575684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415667.716371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415667.846234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415668.009678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415668.127312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415668.257455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415668.382330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415668.520462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415668.638963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415668.772161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415668.900273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415669.041225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415669.162354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415669.305210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415669.429634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415669.581845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415669.688492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415669.815944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415669.937635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415670.077637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415670.192977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415670.323680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415670.444432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415670.570434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415670.691339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415670.824317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415670.946462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415671.075419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415671.211239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415671.338734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415671.477262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415671.615453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415671.747798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415671.894190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415672.022654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415672.153863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415672.275864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415672.405224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415672.545569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415672.679399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415672.800932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415672.930015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415673.054691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415673.191073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415673.316235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415673.442044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415673.568368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415673.702579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415673.820835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415673.967352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415674.096141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415674.233621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415674.379013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415674.509028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415674.633613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415674.768187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415674.895571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415675.022419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415675.150118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415675.291919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415675.421203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415675.553985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415675.688339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415675.809737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415675.947571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415676.088798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415676.231127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415676.354239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415676.482191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415676.625300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415676.749332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415676.884672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415677.012858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415677.131928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415677.262631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415677.390871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415677.523957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415677.661717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415677.771873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415677.904814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415678.044919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415678.192497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415678.312539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415678.461591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415678.563721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415678.693947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415678.824980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415678.959087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415679.083844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415679.212087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415679.371078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415679.502086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415679.624347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415679.757984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415679.881042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415680.009861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415680.142977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415680.276923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415680.415954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415680.563209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415680.680978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415680.813096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415680.938635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415681.071580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415681.196479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415681.354128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415681.466457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415681.610103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415681.732083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415681.879186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415682.018128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415682.147514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415682.260913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415682.387862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415682.523712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415682.681744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415682.795457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415682.919061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415683.084131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415683.233374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415683.349691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415683.480286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415683.618037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415683.760381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415683.875358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415684.001508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415684.135462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415684.260716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415684.525670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415684.632910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415684.757249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415684.903778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415685.014089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415685.144134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415685.286354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415685.413952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415685.545414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415685.677516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415685.805145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415685.955559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415686.073222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415686.235301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415686.443203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415686.797000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415687.118469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415687.380588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415687.628987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415687.879967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415688.022831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415688.195683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415688.395266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415688.507638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415688.630560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415688.807431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415688.944640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415689.081477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415689.193866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415689.324017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415689.447716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415689.581705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415689.715004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415689.857570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415689.981652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415690.117420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415690.238675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415690.380719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415690.565095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415690.696442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415690.818788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415690.945336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415691.069235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415691.202357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415691.323920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415691.523583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415691.645471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415691.771249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415691.962142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415692.102227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415692.238197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415692.420722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415692.547455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415692.687618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415692.809410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415692.956905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415693.122161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415693.254404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415693.379109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415693.502288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415693.639094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415693.753636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415693.884001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415694.020403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415694.148497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415694.293989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415694.421481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415694.575537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415694.689677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415694.816750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415694.940653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415695.067415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415695.187851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415695.319186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415695.444213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415695.571252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415695.697264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415695.829506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415695.965232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415696.108343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415696.243158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415696.379666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415696.499130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415696.630804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415696.751153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415696.891641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415697.009802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415697.146229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415697.287507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415697.408077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415697.542390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415697.685447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415697.811767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415697.938975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415698.054611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415698.189760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415698.314527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415698.438371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415698.562803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415698.687354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415698.816083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415698.943170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415699.068286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415699.228877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415699.338676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415699.463748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415699.600151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415699.745794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415699.872842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415700.000967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415700.127640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415700.258851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415700.385460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415700.513331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415700.634583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415700.768320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415700.897715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415701.020682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415701.170113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415701.312126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415701.433829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415701.566035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415701.693964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415701.814778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415701.944916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415702.084049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415702.217520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415702.354110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415702.485008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415702.626176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415702.750443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415702.877877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415703.023731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415703.129231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415703.249565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415703.382218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415703.503706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415703.634189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415703.758104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415703.888482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415704.021817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415704.150602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415704.285148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415704.429155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415704.559529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415704.690058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415704.806870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415704.961854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415705.063409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415705.200098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415705.314723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415705.452006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415705.582859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415705.704633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415705.834205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415705.962514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415706.104197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415706.238263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415706.377827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415706.496927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415706.621029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415706.755811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415706.883603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415707.006713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415707.128622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415707.258476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415707.381616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415707.506484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415707.632113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415707.759989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415707.883608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415708.015402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415708.143383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415708.287259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415708.416853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415708.572702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415708.680875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415708.822645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415708.937273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415709.074335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415709.198253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415709.325115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415709.459340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415709.602710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415709.736255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415709.868611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415709.999612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415710.133579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415710.259544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415710.384143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415710.508249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415710.642113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415710.767912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415710.914523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415711.042729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415711.182225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415711.298600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415711.430542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415711.553617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415711.692183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415711.816747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415711.960512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415712.086646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415712.215155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415712.354098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415712.496918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415712.624109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415712.757340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415712.875912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415713.007109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415713.145317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415713.270946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415713.386471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415713.518405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415713.647277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415713.790630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415713.899401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415714.058182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415714.168282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415714.316221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415714.448076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415714.564574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415714.686183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415714.816462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415714.955970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415715.070619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415715.198091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415715.336639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415715.462901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415715.589365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415715.709717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415715.857719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415715.983110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415716.115939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415716.233692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415716.386565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415716.508244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415716.629461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415716.758530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415716.904746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415717.021134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415717.166142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415717.302944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415717.411975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415717.549367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415717.686763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415717.811481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415717.963195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415718.078217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415718.206644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415718.344353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415718.476621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415718.603012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415718.731377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415718.865793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415718.999617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415719.126810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415719.257274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415719.383291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415719.516564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415719.643030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415719.770866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415719.931352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415720.060468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415720.193548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415720.319142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415720.454271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415720.575442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415720.708009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415720.847212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415720.992202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415721.106738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415721.241274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415721.374358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415721.498418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415721.627755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415721.769924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415721.880809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415722.046923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415722.176642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415722.305492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415722.439308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415722.561419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415722.688156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415722.820980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415722.957297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415723.070519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415723.199373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415723.337371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415723.461709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415723.602569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415723.750152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415723.888574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415723.998972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415724.126739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415724.262586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415724.397594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415724.527958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415724.664640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415724.791622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415724.920625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415725.045955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415725.185192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415725.306051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415725.437280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415725.558002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415725.683606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415725.810786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415725.936385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415726.057282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415726.183795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415726.320463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415726.441603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415726.564814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415726.689777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415726.823231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415726.978245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415727.105770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415727.239088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415727.371591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415727.497958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415727.638353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415727.762189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415727.886217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415728.022729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415728.153746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415728.284120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415728.439633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415728.567788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415728.691657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415728.817596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415728.940627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415729.067202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415729.192651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415729.318346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415729.446003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415729.594919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415729.695910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415729.832838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415729.955950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415730.086339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415730.209128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415730.341048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415730.483460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415730.605657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415730.735556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415730.875441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415730.999927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415731.118928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415731.250673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415731.374645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415731.495733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415731.613157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415731.749109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415731.875386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415732.004113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415732.122150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415732.270773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415732.379395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415732.506594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415732.643379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415732.778671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415732.916564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415733.039815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415733.174858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415733.310526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415733.439420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415733.566504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415733.686353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415733.813230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415733.941454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415734.062324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415734.186706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415734.321708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415734.433785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415734.569001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415734.758729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415734.888847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415735.009929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415735.140889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415735.261678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415735.419388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415735.539569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415735.671143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415735.811028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415735.952583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415736.079161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415736.199239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415736.333831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415736.477664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415736.618666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415736.761114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415736.877737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415737.007244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415737.134422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415737.267249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415737.396167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415737.545067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415737.662301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415737.808154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415737.921157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415738.056751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415738.180376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415738.314762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415738.432685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415738.584691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415738.711442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415738.823777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415738.967201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415739.106699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415739.229885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415739.366946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415739.500505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415739.626001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415739.742252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415739.866679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415739.994881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415740.130139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415740.254837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415740.392032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415740.516446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415740.642877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415740.766922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415740.911302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415741.060263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415741.186655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415741.310176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415741.434951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415741.579454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415741.692636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415741.818522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415741.999402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415742.124422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415742.239299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415742.372503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415742.505632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415742.625762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415742.755304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415742.882131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415743.008615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415743.131525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415743.258334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415743.383381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415743.514126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415743.642803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415743.769062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415743.904691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415744.042735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415744.164213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415744.311419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415744.442430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415744.560681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415744.679969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415744.819761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415744.935391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415745.071907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415745.196063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415745.321424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415745.446413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415745.572944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415745.708825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415745.831211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415745.968826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415746.120740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415746.249890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415746.371339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415746.500726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415746.624491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415746.747055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415746.873498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415747.039160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415747.187615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415747.312206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415747.444273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415747.568155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415747.692694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415747.820408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415747.948428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415748.068642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415748.208508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415748.339380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415748.479657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415748.596837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415748.728968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415748.867116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415749.001229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415749.123209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415749.253217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415749.384921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415749.515868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415749.639180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415749.771245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415749.914677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415750.038354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415750.174076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415750.313995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415750.444453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415750.587445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415750.696347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415750.820391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415750.946360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415751.072881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415751.207967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415751.353106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415751.478000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415751.611995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415751.737599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415751.872708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415752.019295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415752.158908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415752.271605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415752.420007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415752.544357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415752.668840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415752.801569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415752.934052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415753.061449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415753.182946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415753.303092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415753.433737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415753.558571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415753.694033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415753.839378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415753.946982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415754.081424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415754.212358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415754.338638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415754.486333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415754.631125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415754.748389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415754.876222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415754.994115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415755.117771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415755.246113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415755.360907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415755.498353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415755.627360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415755.755723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415755.962928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415756.316808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415756.642633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415757.032940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415757.437936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415757.668069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415757.992724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415758.171527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415758.365614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415758.499324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415758.688521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415758.935825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415759.156897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415759.316935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415759.511609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415759.681050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415759.853619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415760.028620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415760.192155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415760.377167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415760.540591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415760.692511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415760.874282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415761.047324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415761.231654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415761.378230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415761.561955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415761.750128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415761.919836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415762.128414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415762.278318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415762.428986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415762.629824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415762.813046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415762.990191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415763.231700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415763.385625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415763.580649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415763.761164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415763.886502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415764.084749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415764.222762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415764.417343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415764.566393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415764.792946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415765.084152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415765.285485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415765.418513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415765.557941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415765.706195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415765.822875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415765.948037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415766.073861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415766.208515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415766.350089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415766.494587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415766.649272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415766.792619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415766.976542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415767.135881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415767.299367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415767.486755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415767.664609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415767.831556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415768.016371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415768.192684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415768.336424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415768.503967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415768.690277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415768.828464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415768.996205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415769.187436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415769.376353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415769.526014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415769.700679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415769.874809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415770.035707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415770.228111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415770.357950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415770.541408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415770.813052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415771.055254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415771.359472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415771.636524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415771.790179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415771.942106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415772.064065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415772.199230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415772.313127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415772.441111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415772.575753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415772.695801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415772.820492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415772.955286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415773.088665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415773.228699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415773.359252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415773.490337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415773.610976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415773.750453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415773.882073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415774.111084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415774.269619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415774.382854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415774.514385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415774.642077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415774.782152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415774.911773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415775.037987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415775.171243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415775.311757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415775.458174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415775.569934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415775.704459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415775.819760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415775.955951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415776.085480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415776.225921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415776.354015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415776.492126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415776.632561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415776.767436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415776.896847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415777.441020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415777.603529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415777.752818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415777.912442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415778.081353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415778.228634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415778.374557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415778.491397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415778.621186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415778.754811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415778.876354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415778.997898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415779.131766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415779.278463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415779.401667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415779.540361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415779.670580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415779.794121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415779.938060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415780.064974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415780.192284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415780.320878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415780.453242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415780.581152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415780.712722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415780.848272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415780.983809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415781.116489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415781.260074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415781.371167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415781.502321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415781.629301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415781.768643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415781.893483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415782.055725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415782.182960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415782.320207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415782.456475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415782.574826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415782.715120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415782.831989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415782.961309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415783.104994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415783.231690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415783.362390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415783.484912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415783.622401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415783.740933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415783.884170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415784.005871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415784.152996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415784.287130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415784.418359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415784.545932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415784.664380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415784.814960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415784.934066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415785.063038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415785.186670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415785.319765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415785.441133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415785.581150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415785.694033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415785.814407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415785.944946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415786.074021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415786.203328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415786.329146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415786.472920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415786.602710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415786.741590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415786.866157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415786.988590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415787.117242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415787.249525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415787.370029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415787.500974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415787.627172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415787.754494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415787.890877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415788.018622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415788.150190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415788.273949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415788.412146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415788.547148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415788.680785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415788.813494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415788.943977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415789.060558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415789.187973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415789.310362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415789.445497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415789.563378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415789.689579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415789.816249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415789.944044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415790.069245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415790.212021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415790.328994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415790.468594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415790.591311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415790.729090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415790.869211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415790.992932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415791.122108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415791.237248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415791.370927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415791.500985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415791.633210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415791.760966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415791.893412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415792.036754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415792.157708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415792.293264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415792.416533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415792.551409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415792.685985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415792.809506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415792.941085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415793.065301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415793.185352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415793.311157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415793.439451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415793.559040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415793.692728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415793.810580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415793.941906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415794.061002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415794.191862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415794.319332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415794.442897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415794.583608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415794.705457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415794.831187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415794.960493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415795.096326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415795.250041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415795.363550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415795.497407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415795.620191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415795.754304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415795.896044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415796.018006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415796.162835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415796.270263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415796.408925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415796.544429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415796.682528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415796.841896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415796.985345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415797.121995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415797.238122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415797.369321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415797.490234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415797.623304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415797.748583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415797.876533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415798.002563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415798.132392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415798.254682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415798.384224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415798.516190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415798.663762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415798.780712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415798.925447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415799.051733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415799.168505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415799.309631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415799.445205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415799.569947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415799.709010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415799.835065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415799.972235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415800.108317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415800.249511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415800.376383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415800.516133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415800.628961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415800.770280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415800.884106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415801.015234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415801.149341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415801.286307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415801.431694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415801.571529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415801.696033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415801.827168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415801.972409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415802.111454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415802.238812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415802.365706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415802.507263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415802.630796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415802.754313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415802.880945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415803.004840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415803.144311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415803.266672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415803.400386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415803.525702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415803.683406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415803.804782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415803.945199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415804.082529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415804.205126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415804.330487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415804.462976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415804.594107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415804.737506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415804.856396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415805.009663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415805.117933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415805.253600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415805.377609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415805.525740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415805.631907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415805.765894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415805.892608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415806.027620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415806.166752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415806.295316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415806.425122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415806.559490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415806.689215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415806.814770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415806.938224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415807.066162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415807.194418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415807.323059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415807.440713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415807.574720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415807.694752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415807.849126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415807.975791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415808.123138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415808.234390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415808.376950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415808.494180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415808.625789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415808.747221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415808.920700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415809.040038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415809.168162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415809.307249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415809.438963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415809.562684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415809.714186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415809.818863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415809.947727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415810.075890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415810.224734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415810.350085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415810.499514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415810.619274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415810.749187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415810.866920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415811.021880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415811.124059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415811.247539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415811.389205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415811.518836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415811.639168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415811.769742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415811.918069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415812.060682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415812.192355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415812.313608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415812.435564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415812.568539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415812.705409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415812.819447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415812.948059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415813.060540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415813.193569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415813.323221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415813.458831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415813.598564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415813.712776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415813.857668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415813.978043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415814.135201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415814.239170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415814.371384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415814.504220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415814.645070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415814.756253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415814.890927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415815.012681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415815.159819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415815.289229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415815.418602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415815.541794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415815.703856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415815.812998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415815.937043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415816.054774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415816.187523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415816.314384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415816.446082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415816.567934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415816.698009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415816.828674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415816.953854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415817.080838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415817.205639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415817.342214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415817.518157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415817.691118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415817.847966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415817.976296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415818.092791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415818.228287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415818.384419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415818.490851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415818.632560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415818.753781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415818.912309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415819.029725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415819.163977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415819.310992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415819.428308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415819.549709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415819.698018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415819.807230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415819.940175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415820.069777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415820.226482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415820.340324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415820.491637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415820.620557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415820.756382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415820.877971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415821.009432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415821.135870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415821.266473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415821.398987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415821.539013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415821.678472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415821.816558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415821.939932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415822.073455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415822.202981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415822.331444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415822.462771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415822.606911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415822.737651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415822.872533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415823.002228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415823.134647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415823.253124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415823.378315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415823.502036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415823.630496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415823.754535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415823.894180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415824.038114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415824.166343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415824.289242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415824.424226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415824.551252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415824.682401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415824.802327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415824.933475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415825.065422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415825.194818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415825.318165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415825.469750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415825.595618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415825.734724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415825.874149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415826.007561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415826.124792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415826.251002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415826.379002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415826.505056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415826.627983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415826.758191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415826.880732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415827.017344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415827.132303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415827.258392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415827.381590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415827.524050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415827.646160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415827.797041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415827.914325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415828.047799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415828.174657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415828.305449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415828.425926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415828.560221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415828.683233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415828.807240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415828.934723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415829.080687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415829.187990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415829.320838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415829.445707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415829.583144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415829.704006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415829.836312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415829.967467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415830.117490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415830.247498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415830.372996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415830.495313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415830.642375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415830.753171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415830.883367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415831.005419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415831.138177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415831.265097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415831.392684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415831.520373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415831.667372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415831.814763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415831.941005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415832.070029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415832.235785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415832.351084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415832.499901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415832.613486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415832.731900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415832.863409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415832.991286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415833.127751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415833.248767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415833.373852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415833.498377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415833.619439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415833.748229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415833.865978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415833.998611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415834.126167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415834.269299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415834.404196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415834.540158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415834.675393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415834.809588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415834.934668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415835.062565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415835.202596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415835.316292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415835.435316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415835.559770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415835.701420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415835.828265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415835.948773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415836.080385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415836.217707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415836.350028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415836.482084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415836.614016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415836.746488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415836.872762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415836.994944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415837.121255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415837.245086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415837.381801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415837.504175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415837.644704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415837.770985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415837.901329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415838.037985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415838.185626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415838.303327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415838.439159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415838.561240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415838.691396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415838.811321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415838.941823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415839.063540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415839.194188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415839.317670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415839.453902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415839.583309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415839.716081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415839.860978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415840.005225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415840.125568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415840.272352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415840.404387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415840.544643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415840.664570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415840.808555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415840.932691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415841.079096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415841.186200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415841.306333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415841.440307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415841.579537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415841.707503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415841.842114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415842.001354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415842.130121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415842.254261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415842.396708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415842.512930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415842.661650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415842.791769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415842.923663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415843.050994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415843.185578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415843.304926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415843.441636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415843.568355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415843.690880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415843.828407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415843.971545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415844.103121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415844.230760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415844.361798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415844.483854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415844.621445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415844.757028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415844.884043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415845.040925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415845.148675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415845.316283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415845.432517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415845.560755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415845.682699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415845.828113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415845.949731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415846.097050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415846.226551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415846.359382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415846.503855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415846.623259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415846.742013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415846.878137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415846.997231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415847.129978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415847.254874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415847.388299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415847.513458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415847.644296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415847.773812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415847.934919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415848.050009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415848.185931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415848.310152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415848.429317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415848.558184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415848.692482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415848.821299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415848.937216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415849.063631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415849.189041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415849.326447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415849.638942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415849.805615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415849.953868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415850.086577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415850.207254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415850.347871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415850.478738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415850.609145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415850.751287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415850.878709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415851.001055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415851.140778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415851.254603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415851.374559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415851.514420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415851.634084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415851.766328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415851.889187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415852.036910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415852.147884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415852.277862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415852.413757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415852.539409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415852.680609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415852.803036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415852.928850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415853.109947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415853.242244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415853.372079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415853.496826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415853.628747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415853.753408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415853.890573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415854.006297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415854.148076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415854.285969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415854.423886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415854.539669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415854.677851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415854.805059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415854.940188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415855.077659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415855.192404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415855.314614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415855.451532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415855.597902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415855.746194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415855.894145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415856.013209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415856.128694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415856.274521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415856.412989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415856.541636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415856.667514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415856.810775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415856.931227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415857.065071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415857.189613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415857.324740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415857.443900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415857.572197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415857.694855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415857.826505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415857.955895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415858.113111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415858.240320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415858.372943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415858.499511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415858.640224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415858.746003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415858.863283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415859.006862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415859.141067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415859.262995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415859.412851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415859.533881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415859.666212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415859.794814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415859.951793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415860.085138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415860.202153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415860.337185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415860.478940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415860.604042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415860.752056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415860.872481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415861.000653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415861.133719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415861.271072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415861.383664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415861.516068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415861.654715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415861.796121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415861.922322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415862.064010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415862.177088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415862.312024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415862.437148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415862.583507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415862.709345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415862.842475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415862.963194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415863.120103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415863.230605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415863.363994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415863.489569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415863.642407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415863.746553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415863.881438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415864.019472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415864.145927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415864.258515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415864.392634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415864.539519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415864.684387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415864.808378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415864.928958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415865.060133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415865.184931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415865.307313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415865.440736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415865.561030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415865.693495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415865.827325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415865.952215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415866.083782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415866.219998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415866.356776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415866.482138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415866.620934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415866.764090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415866.875326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415867.000672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415867.131809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415867.258895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415867.389725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415867.514992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415867.642193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415867.784718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415867.921776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415868.051745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415868.176327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415868.304223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415868.427273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415868.556039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415868.676775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415868.806219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415868.944826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415869.066880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415869.188473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415869.313912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415869.437776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415869.571701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415869.699946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415869.839106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415869.967693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415870.106400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415870.243973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415870.377291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415870.498163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415870.624260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415870.767416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415870.898294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415871.022911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415871.171845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415871.303126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415871.429012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415871.565060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415871.692486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415871.817794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415871.959945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415872.081675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415872.227557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415872.362911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415872.513144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415872.620549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415872.747677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415872.873585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415873.017291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415873.137749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415873.265347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415873.388732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415873.528357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415873.655854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415873.794433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415873.921807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415874.056917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415874.188933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415874.328110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415874.451062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415874.569039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415874.700620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415874.827424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415874.964172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415875.110477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415875.231069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415875.370846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415875.486113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415875.615427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415875.747815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415875.879719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415876.008431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415876.141873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415876.298000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415876.419507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415876.553562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415876.677030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415876.808719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415876.934487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415877.060312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415877.193666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415877.315055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415877.445771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415877.567441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415877.705544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415877.826252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415877.948776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415878.082079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415878.204461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415878.349003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415878.474667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415878.602105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415878.737476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415878.859461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415878.992376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415879.118715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415879.245179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415879.369657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415879.502971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415879.616246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415879.736575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415879.874061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415880.000581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415880.130199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415880.286447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415880.397950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415880.541895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415880.665210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415880.819766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415880.946500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415881.070403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415881.202935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415881.322682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415881.459751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415881.602046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415881.730787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415881.852605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415881.995856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415882.122535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415882.261311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415882.384999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415882.515215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415882.661124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415882.786848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415882.932588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415883.047451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415883.186944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415883.302710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415883.436018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415883.563868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415883.700493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415883.823642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415883.965982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415884.085360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415884.230641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415884.359915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415884.488251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415884.626318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415884.748985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415884.866999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415884.998923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415885.121872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415885.256725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415885.373844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415885.501960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415885.632216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415885.765526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415885.899952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415886.049068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415886.176309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415886.304156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415886.433794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415886.563161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415886.688274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415886.827050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415886.936749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415887.072902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415887.184536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415887.312749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415887.443601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415887.577128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415887.706114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415887.836365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415887.967117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415888.102185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415888.233755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415888.369709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415888.490510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415888.618639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415888.809636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415888.937896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415889.063042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415889.190432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415889.313900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415889.448354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415889.577281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415889.715089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415889.853040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415889.970271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415890.117906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415890.255386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415890.378097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415890.505242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415890.628776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415890.763605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415890.896864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415891.038093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415891.165136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415891.286969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415891.425553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415891.555905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415891.677868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415891.808426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415891.942151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415892.059886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415892.183406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415892.315810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415892.442464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415892.569910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415892.689670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415892.826394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415892.958727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415893.092236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415893.224020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415893.360760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415893.485889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415893.620325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415893.743169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415893.870048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415893.992374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415894.129861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415894.249409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415894.367432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415894.498492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415894.625149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415894.767720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415894.877010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415895.006193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415895.138874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415895.261233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415895.417474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415895.528723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415895.666112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415895.799654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415895.931304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415896.053560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415896.181986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415896.304555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415896.442346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415896.563247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415896.694516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415896.818092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415896.949118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415897.098550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415897.226669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415897.358148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415897.492850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415897.619854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415897.748347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415897.875391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415898.011528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415898.141139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415898.266893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415898.398439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415898.517360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415898.652826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415898.809349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415898.918708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415899.051096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415899.179609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415899.311708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415899.437519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415899.554847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415899.686132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415899.811951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415899.942992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415900.070307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415900.193730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415900.326783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415900.455129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415900.589316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415900.726609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415900.884037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415900.995732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415901.125147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415901.255449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415901.390523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415901.523812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415901.662548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415901.789206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415901.945344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415902.077704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415902.190589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415902.323822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415902.470707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415902.597475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415902.740077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415902.874235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415902.997049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415903.118229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415903.248770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415903.376671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415903.511504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415903.628223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415903.761785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415903.929106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415904.042572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415904.179795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415904.301641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415904.424106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415904.574530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415904.685359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415904.838023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415904.942023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415905.079530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415905.212842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415905.331695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415905.464727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415905.596041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415905.729236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415905.874881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415905.992295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415906.120433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415906.243112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415906.371264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415906.506499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415906.638302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415906.741910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415906.871350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415906.998332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415907.129276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415907.252421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415907.378777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415907.503405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415907.646979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415907.765167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415907.919958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415908.054511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415908.176224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415908.302901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415908.433092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415908.553188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415908.684510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415908.802138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415908.933769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415909.074539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415909.186937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415909.313587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415909.450276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415909.590626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415909.727886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415909.847881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415909.968600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415910.103699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415910.238079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415910.375570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415910.498053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415910.625444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415910.755609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415910.874029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415911.006051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415911.140882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415911.272264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415911.390651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415911.535963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415911.665211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415911.806869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415911.932254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415912.060474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415912.182101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415912.317604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415912.456349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415912.563873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415912.695815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415912.825716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415912.950097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415913.091167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415913.224590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415913.371692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415913.500639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415913.629211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415913.757864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415913.885570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415914.008135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415914.144560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415914.285660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415914.411647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415914.535889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415914.673866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415914.796742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415914.927770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415915.048884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415915.177408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415915.297906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415915.448069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415915.557775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415915.678593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415915.869413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415916.014560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415916.160632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415916.296846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415916.432969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415916.550987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415916.682804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415916.807669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415916.928477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415917.057432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415917.198521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415917.317737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415917.439383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415917.569300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415917.688947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415917.815756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415917.953856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415918.076492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415918.209585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415918.351158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415918.473114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415918.611663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415918.737813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415918.886873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415918.994292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415919.120844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415919.246805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415919.376607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415919.502212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415919.629560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415919.753277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415919.887017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415920.015867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415920.150257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415920.296112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415920.419351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415920.543675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415920.672057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415920.823937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415920.954390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415921.076861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415921.227331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415921.348931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415921.475976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415921.614082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415921.738171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415921.878549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415922.018741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415922.204042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415922.331139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415922.470271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415922.610568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415922.736917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415922.857131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415923.000972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415923.121455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415923.250552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415923.372185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415923.499869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415923.624396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415923.747299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415923.874792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415924.000731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415924.132176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415924.262186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415924.399133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415924.517736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415924.676884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415924.784762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415924.922538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415925.042904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415925.198018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415925.300988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415925.441426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415925.555398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415925.682997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415925.864148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415925.992241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415926.112779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415926.249073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415926.370395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415926.500222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415926.639369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415926.756008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415926.887341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415927.011555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415927.141782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415927.269632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415927.393961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415927.539417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415927.663785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415927.810118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415927.930895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415928.077044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415928.185622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415928.347095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415928.452527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415928.577806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415928.711200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415928.830188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415928.973238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415929.111739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415929.232067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415929.366091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415929.498365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415929.617824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415929.741963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415929.873812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415929.994225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415930.125988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415930.240805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415930.380749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415930.504548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415930.633531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415930.771056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415931.052525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415931.181576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415931.307342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415931.458541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415931.751966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415931.989424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415932.263739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415932.584507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415932.918306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415933.263715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415933.742356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415934.016939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415934.185587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415934.358500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415934.631547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415934.783710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415934.894701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415935.051190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415935.244035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415935.419934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415935.569714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415935.757224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415935.912644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415936.067898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415936.230522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415936.409117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415936.576192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415936.806173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415936.950678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415937.117265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415937.253236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415937.425011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415937.604789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415937.762683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415937.937697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415938.104465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415938.268249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415938.451529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415938.607522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415938.793243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415938.956487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415939.115724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415939.267527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415939.435038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415939.727492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415939.923285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415940.070525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415940.289943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415940.426594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415940.622407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415940.766086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415940.897494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415941.063377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415941.288829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415941.610751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415941.794013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415941.919317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415942.051000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415942.178592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415942.304963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415942.426226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415942.542340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415942.678133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415942.802758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415942.932117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415943.054856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415943.178148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415943.310452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415943.432796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415943.556923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415943.685368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415943.803147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415944.465338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415944.686115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415944.887635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415945.089325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415945.308034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415945.507483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415945.643917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415945.813490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415945.999215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415946.177203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415946.322587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415946.534906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415946.712853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415946.896731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415947.063553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415947.236676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415947.414479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415947.581367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415947.743469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415947.926364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415948.135148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415948.288240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415948.478107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415948.802433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415949.076866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415949.324002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415949.449248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415949.606608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415949.728762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415949.862668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415949.983539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415950.109631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415950.242010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415950.366410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415950.493102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415950.621929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415950.771111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415950.877593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415951.000545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415951.145806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415951.256634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415951.406876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415951.545608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415951.803510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415951.920083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415952.054107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415952.171661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415952.295406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415952.429554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415952.563505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415952.689955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415952.828368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415952.941134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415953.092419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415953.202508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415953.329754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415953.465246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415953.603079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415953.745099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415953.861032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415953.995803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415954.169500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415954.267177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415954.397290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415954.543055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415954.673994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415954.798539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415954.926633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415955.047509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415955.178529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415955.303047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415955.433892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415955.550470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415955.686969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415955.813308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415955.946434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415956.056852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415956.191294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415956.315520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415956.470199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415956.603410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415956.730586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415956.886098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415956.997279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415957.126739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415957.258243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415957.385964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415957.522506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415957.655213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415957.807862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415957.924382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415958.057595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415958.182056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415958.310562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415958.437329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415958.569500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415958.689197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415958.821304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415958.950458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415959.125126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415959.241013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415959.381472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415959.496169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415959.642314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415959.749363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415959.898917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415960.043951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415960.185656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415960.302985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415960.429773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415960.555068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415960.685136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415960.806539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415960.937733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415961.075671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415961.198168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415961.319827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415961.456110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415961.591742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415961.724711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415961.858460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415962.037899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415962.150443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415962.289786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415962.429423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415962.561595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415962.687561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415962.816673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415962.951139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415963.071167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415963.198831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415963.354637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415963.479931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415963.617220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415963.743995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415963.874402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415964.015874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415964.178522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415964.295147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415964.429066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415964.576742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415964.701675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415964.816889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415964.941227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415965.084870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415965.202842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415965.339678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415965.483933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415965.608521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415965.744655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415965.875522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415965.994332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415966.125667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415966.251855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415966.389717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415966.518260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415966.659216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415966.791538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415966.916232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415967.050534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415967.176298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415967.307958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415967.427926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415967.554028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415967.683239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415967.812771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415967.964224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415968.094872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415968.224292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415968.371448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415968.490045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415968.614104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415968.736090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415968.873059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415968.991865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415969.134238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415969.260289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415969.387665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415969.531785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415969.662846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415969.786712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415969.929310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415970.055656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415970.201059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415970.308567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415970.430766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415970.560738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415970.693467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415970.819772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415970.947533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415971.076864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415971.205236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415971.346375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415971.470213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415971.600458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415971.724671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415971.864594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415971.997985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415972.120772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415972.252851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415972.375882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415972.502396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415972.700031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415972.825712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415972.953518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415973.081898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415973.210361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415973.340873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415973.466314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415973.606861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415973.735148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415973.867643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415973.989434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415974.222943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415974.346488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415974.484409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415974.617914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415974.746589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415974.872195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415974.999366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415975.138262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415975.265490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415975.387891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415975.543017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415975.658245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415975.794462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415975.929843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415976.072449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415976.187301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415976.346324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415976.453426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415976.591080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415976.718252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415976.849448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415976.977293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415977.116309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415977.236587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415977.377911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415977.487525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415977.625979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415977.746416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415977.876363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415978.002065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415978.130451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415978.268012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415978.409521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415978.540959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415978.668662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415978.779919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415978.911525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415979.040075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415979.411621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415979.561999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415979.703451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415979.832183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415979.949259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415980.092991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415980.232754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415980.361134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415980.489366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415980.616446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415980.740005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415980.868440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415981.001774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415981.128297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415981.267923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415981.397312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415981.530118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415981.651314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415981.802778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415981.941580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415982.065179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415982.192059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415982.318338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415982.449998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415982.582057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415982.728508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415982.834424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415982.974622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415983.101791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415983.247289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415983.385594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415983.499899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415983.634759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415983.763458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415983.889792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415984.025670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415984.164616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415984.312353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415984.431806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415984.571244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415984.688582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415984.817611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415984.936225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415985.062156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415985.200093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415985.321541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415985.468009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415985.592210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415985.719031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415985.848557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415985.995764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415986.118488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415986.271813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415986.473832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415986.670103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415986.801044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415986.931535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415987.054389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415987.182686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415987.309352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415987.435277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415987.561906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415987.690565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415987.832115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415987.963921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415988.100762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415988.235932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415988.366182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415988.496765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415988.636580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415988.781517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415988.885317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415989.034716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415989.172669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415989.320592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415989.431444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415989.559210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415989.698288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415989.847175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415989.965604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415990.094877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415990.213133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415990.360518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415990.480284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415990.619850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415990.749536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415990.875984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415990.997984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415991.127172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415991.255554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415991.396994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415991.509938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415991.651057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415991.792131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415991.938714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415992.065931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415992.223996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415992.467344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415992.613018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415992.743982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415992.876191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415993.009344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415993.121489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415993.265195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415993.391145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415993.515599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415993.657996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415993.782046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415993.927609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415994.058095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415994.179678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415994.325855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415994.435414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415994.562043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415994.696849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415994.825272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415994.950438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415995.087495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415995.220047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415995.362218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415995.503078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415995.637787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415995.739203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415995.871277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415995.995123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415996.136343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415996.251530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415996.386428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415996.510706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415996.637586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415996.771731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415996.895340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415997.034677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638415997.176305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415997.297475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415997.418567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415997.553017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415997.685095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415997.806154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415997.937846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415998.071192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415998.196498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415998.339273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415998.468497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415998.601899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415998.739405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415998.870897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415998.997109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415999.132719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415999.254810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415999.390037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415999.531487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415999.673137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415999.792689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638415999.928923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416000.057822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416000.179004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416000.309607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416000.439039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416000.565946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416000.692676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416000.826379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416000.949620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416001.093266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416001.213352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416001.339836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416001.475016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416001.611901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416001.739808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416001.873002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416001.996654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416002.123610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416002.251229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416002.388268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416002.513902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416002.641334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416002.775521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416002.906890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416003.038208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416003.163623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416003.318109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416003.434947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416003.555281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416003.687342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416003.824115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416003.948952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416004.121754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416004.245811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416004.369136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416004.502782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416004.622926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416004.768950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416004.888482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416005.041536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416005.166726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416005.296420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416005.424581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416005.548723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416005.668794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416005.808511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416005.925526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416006.078700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416006.197420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416006.311130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416006.443966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416006.573609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416006.697961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416006.846777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416006.972415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416007.138654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416007.255357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416007.376447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416007.510010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416007.643710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416007.785266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416007.940023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416008.045600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416008.187532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416008.301871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416008.432280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416008.552612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416008.683639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416008.807043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416008.935311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416009.099141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416009.241469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416009.362275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416009.494960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416009.622324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416009.751808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416009.879225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416010.020140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416010.145930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416010.270718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416010.413809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416010.541148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416010.680122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416010.806809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416010.931200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416011.059487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416011.182220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416011.308613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416011.435696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416011.566014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416011.695907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416011.829258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416011.962414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416012.093710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416012.237691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416012.358279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416012.489047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416012.614591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416012.739685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416012.868900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416012.995628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416013.125621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416013.249652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416013.385136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416013.511448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416013.644155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416013.776460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416013.908545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416014.041149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416014.177431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416014.310995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416014.448625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416014.554602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416014.683647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416014.808075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416014.933213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416015.058930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416015.195767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416015.324857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416015.451741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416015.576234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416015.725283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416015.858212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416015.993551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416016.120914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416016.244324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416016.376878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416016.520481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416016.629045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416016.761552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416016.904794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416017.049471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416017.171393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416017.306205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416017.434010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416017.593000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416017.705627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416017.830378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416017.955667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416018.096905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416018.239509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416018.367213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416018.489555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416018.618530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416018.744446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416018.880292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416018.997181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416019.172076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416019.291116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416019.424504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416019.549981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416019.679416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416019.807588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416019.982836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416020.098408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416020.242567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416020.365554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416020.496209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416020.612299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416020.742951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416020.860793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416020.995952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416021.118324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416021.245094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416021.372355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416021.495872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416021.621713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416021.775811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416021.934447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416022.081481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416022.203848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416022.339568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416022.468760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416022.596500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416022.727448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416022.866403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416022.984909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416023.118109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416023.233601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416023.371903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416023.495368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416023.628949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416023.751722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416023.905013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416024.041757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416024.200109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416024.315224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416024.448982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416024.581662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416024.720068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416024.828071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416024.974380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416025.093759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416025.239589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416025.362100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416025.488675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416025.614324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416025.744298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416025.869806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416025.995577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416026.119972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416026.249074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416026.380118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416026.522513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416026.640369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416026.760022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416026.890474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416027.013240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416027.158744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416027.278610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416027.424060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416027.546373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416027.688925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416027.872465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416028.009353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416028.136672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416028.265600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416028.409471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416028.527514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416028.671616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416028.792570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416028.922825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416029.055661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416029.187818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416029.328194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416029.446452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416029.580086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416029.702298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416029.839697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416029.980781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416030.117932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416030.246062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416030.372095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416030.496088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416030.622397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416030.752409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416030.876018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416031.003914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416031.133897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416031.266872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416031.405801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416031.531937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416031.659106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416031.798570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416031.927957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416032.076430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416032.190415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416032.326013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416032.452314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416032.594635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416032.735492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416032.866948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416032.994894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416033.121984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416033.235597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416033.368904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416033.503054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416033.618341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416033.738072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416033.872720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416033.992245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416034.127559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416034.261717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416034.387474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416034.520089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416034.659965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416034.783313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416034.944501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416035.054832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416035.187083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416035.312781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416035.452732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416035.587493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416035.720580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416035.855318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416035.998200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416036.123460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416036.257855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416036.389974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416036.524613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416036.634097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416036.787861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416036.918067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416037.042548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416037.181509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416037.319788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416037.432392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416037.553819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416037.688359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416037.813462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416037.940645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416038.066604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416038.196302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416038.339253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416038.474709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416038.605670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416038.735501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416038.865538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416038.988777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416039.126001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416039.243075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416039.375895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416039.501776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416039.650271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416039.779867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416039.907247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416040.045751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416040.182141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416040.315281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416040.432370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416040.554339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416040.699755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416040.811145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416040.938475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416041.073050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416041.198549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416041.323620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416041.461284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416041.592479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416041.715754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416041.854520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416042.003400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416042.114718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416042.242944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416042.370681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416042.512382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416042.633789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416042.806368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416042.919176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416043.053657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416043.184567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416043.307030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416043.438375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416043.558301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416043.687319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416043.808686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416043.938976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416044.073046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416044.210497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416044.348091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416044.488568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416044.627658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416044.739977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416044.879703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416044.987493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416045.121989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416045.242478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416045.384885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416045.491700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416045.627580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416045.746420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416045.879706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416046.003778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416046.128601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416046.268425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416046.413186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416046.529087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416046.696424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416046.802745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416046.937317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416047.064911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416047.188515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416047.324631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416047.466979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416047.596197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416047.726415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416047.862072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416047.996789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416048.138639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416048.246688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416048.375741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416048.521898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416048.641973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416048.773100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416048.927784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416049.050014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416049.178882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416049.311767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416049.432126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416049.563941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416049.687598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416049.824682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416049.949872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416050.104914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416050.227610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416050.356379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416050.488131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416050.620016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416050.751979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416050.877333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416051.024549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416051.155398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416051.285645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416051.423039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416051.548923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416051.677443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416051.801700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416051.935237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416052.073653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416052.215012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416052.346252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416052.471415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416052.610819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416052.742111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416052.868636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416052.996487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416053.121194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416053.246250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416053.371011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416053.495239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416053.624349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416053.750297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416053.876803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416054.004824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416054.180296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416054.307694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416054.434906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416054.558556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416054.682101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416054.805894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416054.944689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416055.066824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416055.187535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416055.313136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416055.443547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416055.568423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416055.698870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416055.846290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416055.959504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416056.101267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416056.219926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416056.358742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416056.480899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416056.609700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416056.742407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416056.866941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416056.990012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416057.122518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416057.244535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416057.373904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416057.510690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416057.657913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416057.765467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416057.899565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416058.035105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416058.162002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416058.284986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416058.413117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416058.547354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416058.678689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416058.800618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416058.932017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416059.051302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416059.214581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416059.352285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416059.477197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416059.613682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416059.736730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416059.862277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416059.995731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416060.120969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416060.247594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416060.361976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416060.491239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416060.636221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416060.748609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416060.880597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416061.025596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416061.135051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416061.269094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416061.418226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416061.546974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416061.676590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416061.819315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416061.923948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416062.060118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416062.177583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416062.308227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416062.426142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416062.556018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416062.682889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416062.812770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416062.938095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416063.066018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416063.202483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416063.322480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416063.468288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416063.610722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416063.734365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416063.864721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416063.989533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416064.117089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416064.261735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416064.393691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416064.520545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416064.672109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416064.804217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416064.929149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416065.053974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416065.183633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416065.308519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416065.434970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416065.562320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416065.693994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416065.828814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416065.951480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416066.086565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416066.222056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416066.370194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416066.507495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416066.616855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416066.742294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416066.872884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416067.006972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416067.121640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416067.277846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416067.381904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416067.517622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416067.657493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416067.795493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416067.919513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416068.047168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416068.176896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416068.312459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416068.423048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416068.551473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416068.684055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416068.812430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416068.942610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416069.071031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416069.240215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416069.368552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416069.488886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416069.622595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416069.745424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416069.874480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416069.997600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416070.125468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416070.257076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416070.407561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416070.533123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416070.657076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416070.782170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416070.917798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416071.049450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416071.176715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416071.294773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416071.426948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416071.546305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416071.694693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416071.828521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416071.934466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416072.060611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416072.196933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416072.320763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416072.449263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416072.577666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416072.701283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416072.856436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416072.991391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416073.117958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416073.246387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416073.364906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416073.489366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416073.620530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416073.779160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416073.904563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416074.058390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416074.219584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416074.348704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416074.478122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416074.616887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416074.738259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416074.869343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416074.996212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416075.133167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416075.245847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416075.386150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416075.514186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416075.655104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416075.772881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416075.913994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416076.043575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416076.178289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416076.290641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416076.429051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416076.554840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416076.678508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416076.803852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416076.943066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416077.053465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416077.184260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416077.305520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416077.447248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416077.553352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416077.679169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416077.809043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416077.946930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416078.060795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416078.187004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416078.318178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416078.440381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416078.573153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416078.711816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416078.840637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416078.981301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416079.129723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416079.258581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416079.380289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416079.523169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416079.655569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416079.827899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416080.017701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416080.150301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416080.284102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416080.419575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416080.538004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416080.660931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416080.805631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416080.928696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416081.055511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416081.182121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416081.307876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416081.445872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416081.561314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416081.688762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416081.820081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416081.980964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416082.116738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416082.246493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416082.373117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416082.505516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416082.631859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416082.778089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416082.905465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416083.043877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416083.170292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416083.306997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416083.431233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416083.553943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416083.676311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416083.807227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416083.936425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416084.065729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416084.199733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416084.336831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416084.466309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416084.604203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416084.731270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416084.864275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416084.989511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416085.133402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416085.240501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416085.367797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416085.490512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416085.616018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416085.755013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416085.865914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416085.997484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416086.133308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416086.263489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416086.392853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416086.526462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416086.657115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416086.789569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416086.928735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416087.045510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416087.182049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416087.302375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416087.429278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416087.554656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416087.697171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416087.803478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416087.944313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416088.075898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416088.238306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416088.354315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416088.487107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416088.610931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416088.752132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416088.868144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416088.993942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416089.118129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416089.249509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416089.373716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416089.490062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416089.622376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416089.749166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416089.872458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416090.009533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416090.131055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416090.281925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416090.415648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416090.554515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416090.694096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416090.821623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416090.931403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416091.057073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416091.191209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416091.319729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416091.445528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416091.577536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416091.709460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416091.850054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416091.981713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416092.117935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416092.238435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416092.367735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416092.488718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416092.614780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416092.744186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416092.866019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416093.000000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416093.124366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416093.258649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416093.383865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416093.510208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416093.646379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416093.780503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416093.921139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416094.055002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416094.188959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416094.312329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416094.467830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416094.592434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416094.731602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416094.864920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416094.986795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416095.111897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416095.242186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416095.369946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416095.493326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416095.615478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416095.747239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416095.874306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416096.034339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416096.169974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416096.282199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416096.413730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416096.551309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416096.673000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416096.807800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416096.944519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416097.082762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416097.203458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416097.343623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416097.460485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416097.598746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416097.734656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416097.856544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416097.999402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416098.114785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416098.240672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416098.374376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416098.497791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416098.627163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416098.760438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416098.890412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416099.004061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416099.143147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416099.343236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416099.477595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416099.607553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416099.737568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416099.864573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416099.984635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416100.126662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416100.254640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416100.366698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416100.507511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416100.618450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416100.737447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416100.876395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416101.011629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416101.138122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416101.259636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416101.401080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416101.543020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416101.674447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416101.800785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416101.934216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416102.064882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416102.244805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416102.372448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416102.495948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416102.615396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416102.740441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416102.871075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416103.007953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416103.127047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416103.258736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416103.381445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416103.510115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416103.645764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416103.776872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416103.905871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416104.038213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416104.192775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416104.296909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416104.421039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416104.551650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416104.683719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416104.803853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416104.938023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416105.068876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416105.209126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416105.356060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416105.495858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416105.615273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416105.742724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416105.884497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416106.004313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416106.136310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416106.267365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416106.395092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416106.553062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416106.675219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416106.800187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416106.928745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416107.057622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416107.197525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416107.309576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416107.441638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416107.568651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416107.693752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416107.838425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416107.968296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416108.100739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416108.233563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416108.363297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416108.483533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416108.613630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416108.741699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416108.882741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416108.999035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416109.153832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416109.279951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416109.403864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416109.532411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416109.680033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416109.795754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416109.925289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416110.054289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416110.186413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416110.299152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416110.436118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416110.572926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416110.696926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416110.853421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416110.967554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416111.103983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416111.238368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416111.363732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416111.494428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416111.620388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416111.755286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416111.874471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416112.034667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416112.156219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416112.312973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416112.427312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416112.542218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416112.676828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416112.812565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416112.946119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416113.076128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416113.200887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416113.356794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416113.473985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416113.613122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416113.731836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416113.881304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416114.003800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416114.131977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416114.265772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416114.409191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416114.536272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416114.662659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416114.788801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416114.920133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416115.041874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416115.167271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416115.294456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416115.427840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416115.559164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416115.673156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416115.810697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416115.931101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416116.054642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416116.179159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416116.305286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416116.433514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416116.557266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416116.684966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416116.814486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416116.954649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416117.072861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416117.211603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416117.346663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416117.484688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416117.612451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416117.733173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416117.861134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416117.990147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416118.122063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416118.235630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416118.362463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416118.495110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416118.613956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416118.741937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416118.881061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416118.994715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416119.129722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416119.274286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416119.391176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416119.577301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416119.727509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416119.862887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416119.987376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416120.123302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416120.238460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416120.381900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416120.508832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416120.629739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416120.758503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416120.905023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416121.042721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416121.186375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416121.300694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416121.423172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416121.554424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416121.683519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416121.813477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416121.950155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416122.086448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416122.225101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416122.348053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416122.475969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416122.607018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416122.739877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416122.863822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416122.993556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416123.122235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416123.253867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416123.382238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416123.507889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416123.635453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416123.777553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416123.937906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416124.072243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416124.197825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416124.332624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416124.467556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416124.604007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416124.727090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416124.866373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416124.982537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416125.132832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416125.245836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416125.379308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416125.503973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416125.630899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416125.756587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416125.889045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416126.033615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416126.172878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416126.288781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416126.436430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416126.542088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416126.672714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416126.802562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416126.927744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416127.050416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416127.177459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416127.306711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416127.435916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416127.557798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416127.697722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416127.836998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416127.981359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416128.107516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416128.250684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416128.363976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416128.504697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416128.630528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416128.743743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416128.881814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416129.034193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416129.376452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416129.590577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416129.831998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416130.140503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416130.437252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416130.789920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416131.224124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416131.518873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416131.681112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416131.903509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416132.122229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416132.253300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416132.445835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416132.671120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416132.831101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416132.999324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416133.155153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416133.308538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416133.479799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416133.655310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416133.793662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416133.963583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416134.129851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416134.304297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416134.481600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416134.685460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416134.811490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416135.034310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416135.191634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416135.371776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416135.549481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416135.728593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416135.899078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416136.036455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416136.195599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416136.342707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416136.515577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416136.721804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416136.941689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416137.156634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416137.369355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416137.508023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416137.703439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416137.856653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416138.009788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416138.150108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416138.313626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416138.571763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416138.894391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416139.062029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416139.181066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416139.307173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416139.434991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416139.570283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416139.696961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416139.820747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416139.978768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416140.098904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416140.226269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416140.356673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416140.487839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416140.623526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416140.843079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416140.994876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416141.159054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416141.317062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416141.476750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416141.668319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416141.819226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416142.057261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416142.223381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416142.420556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416142.598488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416142.748196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416142.927291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416143.121092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416143.284944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416143.427089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416143.633979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416143.766032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416143.946308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416144.115147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416144.278663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416144.438232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416144.611197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416144.803601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416145.113000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416145.378721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416145.621333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416145.763533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416145.913883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416146.054117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416146.180266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416146.297845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416146.425096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416146.544681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416146.677557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416146.799828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416146.929701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416147.056089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416147.188581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416147.309953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416147.440154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416147.568526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416147.697804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416147.825197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416148.011615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416148.238598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416148.363462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416148.486432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416148.608840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416148.741246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416148.860941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416148.987850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416149.107748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416149.236135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416149.363551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416149.506669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416149.613722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416149.727751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416149.867340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416149.995216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416150.117727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416150.241936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416150.370542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416150.502984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416150.623677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416150.757463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416150.881684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416151.018726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416151.158714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416151.280626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416151.442250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416151.554848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416151.670171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416151.804841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416151.925336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416152.055861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416152.181102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416152.302674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416152.425885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416152.557694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416152.679871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416152.810308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416152.945202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416153.066710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416153.209179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416153.366966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416153.484976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416153.614004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416153.739351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416153.881458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416154.012921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416154.171433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416154.288332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416154.434830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416154.546727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416154.671493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416154.803891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416154.934243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416155.057997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416155.190651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416155.317468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416155.459709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416155.618644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416155.763817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416155.897612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416156.049671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416156.174916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416156.301296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416156.429803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416156.559388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416156.686062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416156.812866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416156.941351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416157.074957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416157.202646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416157.325982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416157.464832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416157.609670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416157.741198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416157.869267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416157.986965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416158.123724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416158.246095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416158.400097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416158.530580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416158.676017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416158.797740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416158.928426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416159.045427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416159.176613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416159.303380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416159.441114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416159.566943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416159.701869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416159.823193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416159.999690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416160.107403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416160.246263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416160.364362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416160.512727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416160.654107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416160.794565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416160.928056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416161.052667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416161.177006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416161.311273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416161.427913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416161.574864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416161.685529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416161.809363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416161.947727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416162.079492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416162.218300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416162.356807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416162.487052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416162.615956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416162.737480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416162.867760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416162.988440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416163.117741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416163.239379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416163.364700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416163.482955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416163.621588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416163.736293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416163.864227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416163.988783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416164.123270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416164.241669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416164.379910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416164.509931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416164.663581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416164.796583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416164.922955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416165.038597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416165.186018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416165.291358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416165.427752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416165.549166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416165.669415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416165.794489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416165.925359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416166.044723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416166.170020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416166.298448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416166.428652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416166.548366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416166.682024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416166.806878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416166.930954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416167.056931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416167.183278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416167.304626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416167.435180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416167.551958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416167.695128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416167.807241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416167.935890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416168.064824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416168.192636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416168.324664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416168.453567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416168.587214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416168.718082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416168.857737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416168.982398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416169.103702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416169.241156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416169.354297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416169.497844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416169.614127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416169.747803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416169.868248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416170.003722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416170.136029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416170.264778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416170.406238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416170.571923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416170.725171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416170.863280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416170.986804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416171.115972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416171.239015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416171.368268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416171.485764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416171.618457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416171.760782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416171.879680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416172.031476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416172.172996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416172.298367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416172.423394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416172.548938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416172.677074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416172.796707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416172.934169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416173.049915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416173.181948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416173.305277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416173.440182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416173.567849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416173.700908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416173.835790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416173.981420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416174.107513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416174.231227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416174.360032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416174.488961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416174.624219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416174.743655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416174.864315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416175.009224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416175.120543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416175.244873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416175.370272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416175.517692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416175.640516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416175.778844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416175.905104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416176.052766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416176.162268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416176.286398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416176.410279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416176.543359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416176.682580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416176.814739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416176.942381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416177.052710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416177.180081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416177.309733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416177.432449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416177.560766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416177.691783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416177.808089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416177.943045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416178.059638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416178.181365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416178.309825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416178.431981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416178.574319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416178.722346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416178.861889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416178.999378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416179.117549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416179.238645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416179.368423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416179.488818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416179.625923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416179.746773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416179.900309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416180.023290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416180.160480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416180.280637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416180.407403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416180.548888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416180.680261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416180.796382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416180.931288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416181.049417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416181.188204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416181.309574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416181.432088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416181.559552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416181.686010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416181.820710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416181.964469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416182.092383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416182.217000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416182.346539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416182.485269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416182.610907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416182.740603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416182.866292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416182.991977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416183.133308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416183.276521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416183.400448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416183.528619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416183.660873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416183.788929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416183.925665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416184.047710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416184.169945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416184.300238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416184.422579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416184.550885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416184.680464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416184.813564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416184.944402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416185.085158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416185.191523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416185.325306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416185.463838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416185.593109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416185.717332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416185.851000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416185.975256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416186.107874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416186.242188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416186.360995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416186.483278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416186.615785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416186.742074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416186.865924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416186.986274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416187.113699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416187.234977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416187.358451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416187.482653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416187.615589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416187.742576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416187.890863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416187.995913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416188.118956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416188.256994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416188.399017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416188.506061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416188.650846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416188.781118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416188.911336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416189.036293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416189.191560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416189.334263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416189.462008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416189.596046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416189.737345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416189.923535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416190.095010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416190.216293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416190.356318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416190.482719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416190.615994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416190.754876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416190.875831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416191.006391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416191.146872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416191.277189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416191.420875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416191.540134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416191.682000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416191.818075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416191.930756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416192.060419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416192.201984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416192.335907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416192.479600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416192.598206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416192.732485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416192.862155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416193.005887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416193.130330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416193.269772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416193.386611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416193.517061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416193.654033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416193.797174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416193.916690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416194.061868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416194.168189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416194.334186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416194.439189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416194.558474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416194.688527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416194.835295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416194.966046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416195.094106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416195.228133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416195.356961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416195.480539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416195.613101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416195.742975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416195.878706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416196.012068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416196.154562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416196.277321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416196.422255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416196.547945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416196.678283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416196.796649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416196.924514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416197.055177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416197.184599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416197.308554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416197.441863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416197.566075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416197.712738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416197.843925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416197.983367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416198.113721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416198.248047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416198.377860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416198.505520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416198.643530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416198.779034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416198.915487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416199.055570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416199.169516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416199.303842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416199.424541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416199.557204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416199.680426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416199.815507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416199.956570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416200.102846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416200.231749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416200.363624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416200.509658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416200.632424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416200.756447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416200.898790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416201.028112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416201.182433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416201.309254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416201.420739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416201.545266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416201.680848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416201.805687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416201.955981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416202.103637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416202.237170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416202.364832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416202.485144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416202.612357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416202.746816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416202.870697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416203.002777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416203.149215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416203.279706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416203.409598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416203.538548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416203.664669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416203.787411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416203.932089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416204.056278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416204.182328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416204.331048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416204.443393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416204.599540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416204.729574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416204.864375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416204.983816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416205.115714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416205.246500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416205.386900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416205.522758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416205.654448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416205.774404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416205.904589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416206.040448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416206.176247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416206.292060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416206.424564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416206.547776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416206.678094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416206.807688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416206.930665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416207.055833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416207.183062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416207.306317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416207.436042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416207.590337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416207.708394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416207.839940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416208.005959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416208.120712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416208.237522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416208.357544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416208.488041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416208.615466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416208.754577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416208.877867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416209.012545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416209.140436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416209.293950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416209.413603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416209.546494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416209.666393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416209.803458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416209.923882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416210.072473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416210.175860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416210.296524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416210.440594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416210.566043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416210.692087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416210.822095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416210.970428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416211.108791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416211.250424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416211.362892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416211.492393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416211.603982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416211.737121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416211.870981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416211.986678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416212.121835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416212.242260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416212.369100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416212.495510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416212.632062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416212.756753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416212.902832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416213.034022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416213.167952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416213.301929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416213.422528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416213.541154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416213.671694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416213.790554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416213.919778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416214.043757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416214.176785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416214.293845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416214.427327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416214.544462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416214.674107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416214.806707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416214.929748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416215.053853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416215.183170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416215.306856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416215.448329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416215.575222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416215.716469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416215.857408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416216.004520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416216.138540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416216.272778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416216.401224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416216.537032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416216.665805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416216.798712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416216.916018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416217.052758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416217.167481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416217.303851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416217.429585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416217.564270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416217.692658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416217.816337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416217.949506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416218.105646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416218.222241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416218.357213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416218.481844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416218.619025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416218.739416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416218.880646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416219.007918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416219.157547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416219.294608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416219.412610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416219.545266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416219.678149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416219.803524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416219.929935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416220.067143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416220.187195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416220.314964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416220.447868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416220.600881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416220.730838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416220.865817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416220.987087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416221.113887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416221.241832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416221.378560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416221.510524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416221.642367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416221.799464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416221.925124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416222.066507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416222.170534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416222.306273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416222.442652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416222.565279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416222.707135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416222.822763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416222.955323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416223.097430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416223.219569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416223.346633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416223.482364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416223.610025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416223.730192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416223.865171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416223.989988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416224.116470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416224.244331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416224.377329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416224.510976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416224.634806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416224.770109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416224.894770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416225.031277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416225.168827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416225.299481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416225.429749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416225.554439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416225.695501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416225.813289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416225.926363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416226.047019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416226.169892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416226.313694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416226.425642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416226.545819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416226.669968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416226.795073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416226.925840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416227.052449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416227.180175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416227.304637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416227.428354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416227.560305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416227.696540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416227.836628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416227.966013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416228.091423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416228.223368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416228.357783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416228.484479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416228.609461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416228.737850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416228.861863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416228.993549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416229.115410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416229.247413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416229.377782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416229.510799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416229.651338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416229.785074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416229.916936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416230.057131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416230.175440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416230.305626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416230.427726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416230.566031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416230.693898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416230.835885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416230.964679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416231.109298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416231.243027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416231.361164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416231.488548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416231.615151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416231.755515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416231.867892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416232.024226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416232.177580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416232.313821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416232.438079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416232.568759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416232.692939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416232.830103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416232.965025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416233.080141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416233.218418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416233.357852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416233.485573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416233.629254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416233.748326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416233.868740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416234.000765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416234.129985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416234.253440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416234.387844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416234.527789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416234.654689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416234.801279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416234.917587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416235.050082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416235.172644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416235.295647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416235.418514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416235.550443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416235.693040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416235.824156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416235.938772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416236.052984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416236.177999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416236.309900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416236.438696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416236.565911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416236.692495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416236.833624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416236.971615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416237.112838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416237.234589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416237.378680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416237.492768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416237.611297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416237.740991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416237.875163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416237.997321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416238.178727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416238.352532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416238.481836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416238.607807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416238.733116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416238.856023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416238.996471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416239.110988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416239.237552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416239.370696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416239.495238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416239.624546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416239.754188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416239.897755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416240.032843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416240.155165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416240.292949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416240.415658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416240.554645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416240.674013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416240.798039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416240.923679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416241.069147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416241.176540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416241.313976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416241.444991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416241.575104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416241.719499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416241.857005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416241.981931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416242.111484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416242.233731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416242.361773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416242.506483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416242.640917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416242.762464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416242.920893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416243.038705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416243.174820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416243.297813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416243.434286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416243.546937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416243.672478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416243.823897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416243.953987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416244.078768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416244.213057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416244.349831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416244.478399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416244.609290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416244.735814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416244.859270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416244.988587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416245.119913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416245.242529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416245.366780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416245.504050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416245.621906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416245.754180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416245.885597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416246.027623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416246.171596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416246.298707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416246.424449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416246.556724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416246.688322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416246.805084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416246.930552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416247.085012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416247.208203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416247.357265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416247.481586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416247.608817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416247.730932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416247.857819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416247.976817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416248.112740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416248.233244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416248.363727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416248.497256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416248.630463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416248.751585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416248.888075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416249.033126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416249.164073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416249.296322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416249.427926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416249.547290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416249.676271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416249.806862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416249.928093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416250.063543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416250.178221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416250.305709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416250.437620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416250.566096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416250.714476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416250.848491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416250.991176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416251.113516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416251.241037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416251.366589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416251.490541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416251.615483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416251.750952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416251.883534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416252.019714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416252.129204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416252.277655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416252.404989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416252.539036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416252.662317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416252.796345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416252.916559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416253.050774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416253.174757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416253.307175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416253.426661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416253.552552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416253.688969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416253.817911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416253.947602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416254.088164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416254.225279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416254.360608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416254.493483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416254.613061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416254.737818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416254.872097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416254.999904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416255.125453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416255.251262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416255.388830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416255.528290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416255.663340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416255.788682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416255.912591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416256.037243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416256.182893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416256.289579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416256.416396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416256.539400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416256.671455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416256.793875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416256.922616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416257.045544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416257.177194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416257.300734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416257.445028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416257.564532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416257.702395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416257.831538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416257.979380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416258.100773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416258.227912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416258.348352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416258.493994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416258.616355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416258.741286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416258.861763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416258.990010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416259.123748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416259.268673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416259.403489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416259.534748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416259.656871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416259.796732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416259.930278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416260.086160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416260.204172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416260.318085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416260.471482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416260.599490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416260.727523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416260.858253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416260.975375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416261.119132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416261.242495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416261.374434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416261.499033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416261.626895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416261.774237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416261.903036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416262.065773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416262.198405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416262.328184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416262.487078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416262.596157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416262.731217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416262.855130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416262.998704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416263.116740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416263.251284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416263.374149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416263.506802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416263.649795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416263.797233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416263.924001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416264.057639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416264.178613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416264.311355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416264.436877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416264.572362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416264.715130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416264.850058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416264.974051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416265.124061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416265.228621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416265.365951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416265.492573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416265.630603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416265.778361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416265.903220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416266.037913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416266.181194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416266.291963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416266.421038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416266.557827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416266.679775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416266.803454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416266.929207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416267.061071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416267.230984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416267.375021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416267.510904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416267.647908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416267.781021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416267.936674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416268.051280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416268.176612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416268.320010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416268.453900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416268.591302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416268.723671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416268.861621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416268.984298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416269.115696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416269.246505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416269.374363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416269.503512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416269.644202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416269.774898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416269.905041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416270.029370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416270.183439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416270.292263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416270.426292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416270.553079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416270.679712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416270.802936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416270.944834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416271.073311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416271.231301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416271.354066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416271.488249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416271.614488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416271.749835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416271.883435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416272.014073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416272.160132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416272.283760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416272.408448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416272.549331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416272.671112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416272.801372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416272.930849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416273.063287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416273.183979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416273.319227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416273.455873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416273.598457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416273.718792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416273.857457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416273.981265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416274.114890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416274.231797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416274.360990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416274.480875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416274.609416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416274.735979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416274.858332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416274.988858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416275.122507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416275.240966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416275.391752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416275.495972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416275.645750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416275.781761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416275.938290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416276.060472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416276.190600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416276.328158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416276.471208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416276.594927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416276.725882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416276.850926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416276.979744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416277.104324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416277.250783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416277.353118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416277.504270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416277.618465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416277.741826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416277.890468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416278.018062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416278.154008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416278.292428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416278.419431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416278.537983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416278.666978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416278.804854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416278.919850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416279.049148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416279.180765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416279.300170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416279.429711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416279.570894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416279.683514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416279.832109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416279.965029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416280.108285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416280.233121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416280.360486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416280.486354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416280.613357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416280.736348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416280.865701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416280.983669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416281.114281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416281.234308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416281.363711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416281.489723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416281.624224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416281.748392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416281.893209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416282.025833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416282.157506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416282.285538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416282.423234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416282.538846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416282.669188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416282.794376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416282.928520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416283.054676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416283.194931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416283.319176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416283.446353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416283.576755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416283.707055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416283.834677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416283.989230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416284.107660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416284.238264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416284.361744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416284.489856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416284.614624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416284.748616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416284.880790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416285.019222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416285.147292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416285.275317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416285.409585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416285.540634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416285.670780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416285.798564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416285.912077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416286.051697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416286.173088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416286.358538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416286.577631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416286.735071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416286.877088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416286.982608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416287.113855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416287.256738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416287.377119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416287.491483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416287.615134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416287.735632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416287.865924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416287.996866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416288.132377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416288.256279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416288.400595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416288.537681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416288.666364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416288.788010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416288.910761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416289.039166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416289.173958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416289.288693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416289.418429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416289.548522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416289.686999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416289.796142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416289.926796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416290.044049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416290.173204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416290.295969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416290.439924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416290.563833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416290.688163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416290.813711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416290.947778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416291.090004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416291.218448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416291.346268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416291.485193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416291.608546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416291.733844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416291.878036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416292.020714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416292.156188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416292.297187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416292.414350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416292.546642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416292.672458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416292.810878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416292.941299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416293.083309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416293.225983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416293.354212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416293.477581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416293.603993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416293.731546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416293.873540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416293.997260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416294.105248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416294.231880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416294.363016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416294.483655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416294.611216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416294.739011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416294.864387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416294.995719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416295.127604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416295.254731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416295.383038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416295.520949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416295.655841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416295.775355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416295.908157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416296.049758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416296.167606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416296.295885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416296.426146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416296.554410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416296.680697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416296.810108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416296.931723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416297.063369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416297.186750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416297.334776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416297.463846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416297.595142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416297.731151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416297.860233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416298.002318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416298.113813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416298.243967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416298.395801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416298.535883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416298.659257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416298.790401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416298.910798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416299.045732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416299.168251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416299.290764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416299.420163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416299.544496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416299.666986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416299.800668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416299.925291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416300.062826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416300.188439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416300.333179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416300.452380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416300.603209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416300.718453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416300.858419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416300.996958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416301.110723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416301.235718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416301.374029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416301.493224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416301.645664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416301.755158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416301.883756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416302.023254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416302.146926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416302.275735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416302.412975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416302.536398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416302.668500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416302.804832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416302.937249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416303.069918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416303.204166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416303.328633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416303.469141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416303.605530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416303.735330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416303.863949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416304.003399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416304.135160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416304.250708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416304.385408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416304.538219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416304.661759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416304.803888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416304.923196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416305.044215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416305.177343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416305.344271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416305.445542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416305.580863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416305.724419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416305.846332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416305.971776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416306.100407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416306.220647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416306.372112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416306.482791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416306.617714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416306.749768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416306.867554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416306.999803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416307.144975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416307.276210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416307.397981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416307.544539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416307.672222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416307.809030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416307.929821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416308.050833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416308.200666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416308.314107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416308.446070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416308.579916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416308.715538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416308.841677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416308.977836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416309.110687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416309.238784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416309.355400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416309.479109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416309.611483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416309.736290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416309.858400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416310.038407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416310.212904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416310.544684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416310.751603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416311.064016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416311.514223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416311.848257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416312.239336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416312.497699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416312.707744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416312.914085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416313.108797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416313.305916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416313.483133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416313.651417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416313.813581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416314.005414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416314.196373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416314.361238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416314.547680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416314.688653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416314.892624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416315.053270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416315.226406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416315.398743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416315.551653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416315.719382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416315.944917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416316.086128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416316.259577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416316.440124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416316.583092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416316.796037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416316.961691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416317.178416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416317.339406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416317.530925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416317.737863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416317.977458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416318.161669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416318.333963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416318.491077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416318.622335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416318.789870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416318.927587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416319.084423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416319.252821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416319.431986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416319.772522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416319.991658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416320.168667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416320.293703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416320.425322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416320.556364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416320.690564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416320.856093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416321.049046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416321.248379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416321.397102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416321.578854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416321.792971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416322.001970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416322.130300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416322.328224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416322.476335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416322.669492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416322.822560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416323.000576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416323.178832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416323.340682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416323.540500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416323.697256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416323.861742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416324.045311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416324.227446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416324.411868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416324.579289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416324.739529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416324.920837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416325.213313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416325.471752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416325.711143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416325.853450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416325.999208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416326.132554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416326.250582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416326.381419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416326.516264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416326.647489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416326.797627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416326.908488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416327.047884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416327.174028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416327.299691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416327.425076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416327.560278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416327.683626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416327.856738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416327.984029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416328.210233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416328.370778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416328.496182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416328.624842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416328.747759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416328.878813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416329.025532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416329.148110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416329.288858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416329.413207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416329.541688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416329.667053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416329.804483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416329.929694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416330.059703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416330.189226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416330.320835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416330.450758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416330.600768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416330.729482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416330.859718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416330.975952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416331.107816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416331.235876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416331.358635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416331.484076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416331.612788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416331.747304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416331.873120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416332.001490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416332.147521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416332.275329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416332.418314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416332.541361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416332.669816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416332.814508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416332.926550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416333.046331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416333.177847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416333.335469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416333.468246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416333.594353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416333.723703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416333.854838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416333.984294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416334.106464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416334.251116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416334.377878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416334.519624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416334.641613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416334.770819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416334.917328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416335.035696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416335.163895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416335.299982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416335.417555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416335.537522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416335.675245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416335.800038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416335.947685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416336.078987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416336.211197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416336.359290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416336.476737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416336.623174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416336.728259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416336.857031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416336.982004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416337.107927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416337.229598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416337.360682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416337.479822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416337.614837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416337.738075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416337.857507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416337.980204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416338.109085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416338.236984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416338.359736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416338.487563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416338.624885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416338.752254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416338.889927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416339.023906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416339.150117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416339.291563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416339.417156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416339.548522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416339.688901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416339.795285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416339.930734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416340.052563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416340.190767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416340.319214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416340.456709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416340.598680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416340.730098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416340.852383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416340.991780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416341.115181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416341.246185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416341.371049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416341.502060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416341.624119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416341.766831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416341.901211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416342.032517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416342.166994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416342.295365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416342.419212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416342.551597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416342.668101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416342.797889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416342.922209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416343.050136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416343.172344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416343.315658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416343.435124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416343.564196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416343.701932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416343.825602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416343.954586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416344.087271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416344.222057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416344.355381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416344.477766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416344.607321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416344.733658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416344.873208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416344.982104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416345.108430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416345.233371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416345.363387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416345.488112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416345.620949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416345.757608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416345.891536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416346.018110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416346.151722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416346.277163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416346.430743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416346.538655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416346.674609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416346.793749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416346.919205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416347.045690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416347.183352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416347.311301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416347.459839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416347.583407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416347.723420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416347.847609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416347.987656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416348.123217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416348.242825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416348.373141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416348.509008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416348.638761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416348.786267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416348.906788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416349.039622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416349.167217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416349.298013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416349.440842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416349.570865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416349.696129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416349.830457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416349.966104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416350.103422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416350.226424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416350.357340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416350.484683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416350.610044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416350.738213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416350.871422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416351.008543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416351.144186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416351.275826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416351.412483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416351.539469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416351.664649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416351.802572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416351.927732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416352.068899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416352.203826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416352.339399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416352.474401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416352.602877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416352.754427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416352.937717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416353.052372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416353.178985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416353.303185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416353.437939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416353.560784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416353.694313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416353.836096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416353.965544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416354.094032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416354.219109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416354.347485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416354.478580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416354.608028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416354.732769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416354.864471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416354.995428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416355.128857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416355.262316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416355.394083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416355.531570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416355.650015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416355.786416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416355.918828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416356.041981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416356.171125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416356.302055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416356.429588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416356.555709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416356.690992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416356.830995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416356.960833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416357.097547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416357.231579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416357.352642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416357.476917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416357.604214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416357.729918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416357.858075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416357.983719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416358.107092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416358.250293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416358.355917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416358.484462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416358.608455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416358.734256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416358.857933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416359.005211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416359.125721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416359.249461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416359.381960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416359.513337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416359.653244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416359.784971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416359.914917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416360.041927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416360.171093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416360.300380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416360.426138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416360.554291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416360.682183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416360.816271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416360.949148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416361.083442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416361.226646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416361.356481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416361.481165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416361.610376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416361.733698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416361.860925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416361.983565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416362.113811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416362.253060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416362.366623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416362.491392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416362.639953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416362.780935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416362.907930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416363.035298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416363.167244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416363.289351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416363.412901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416363.542932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416363.672967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416363.795552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416363.926977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416364.061719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416364.179028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416364.329282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416364.464856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416364.586175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416364.723346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416364.846063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416364.981178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416365.103882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416365.264347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416365.379601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416365.518875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416365.638060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416365.768148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416365.900846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416366.031582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416366.162691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416366.288877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416366.415693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416366.542716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416366.670417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416366.813770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416366.934556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416367.078212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416367.220529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416367.367984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416367.475628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416367.606934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416367.733676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416367.857698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416367.998102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416368.112994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416368.233347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416368.364884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416368.484257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416368.627163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416368.750796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416368.880595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416369.014252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416369.143571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416369.278017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416369.419330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416369.532003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416369.664975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416369.785629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416369.917797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416370.050672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416370.164853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416370.284819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416370.420966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416370.542216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416370.671303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416370.866659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416371.042718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416371.196361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416371.334242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416371.465925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416371.595064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416371.730748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416371.863708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416371.988980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416372.123448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416372.255296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416372.395039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416372.532439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416372.677341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416372.795918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416372.921427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416373.042389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416373.178098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416373.301259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416373.426234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416373.564780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416373.710782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416373.842137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416373.978565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416374.096093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416374.223912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416374.350647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416374.483229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416374.606811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416374.737325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416374.877988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416374.996610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416375.122820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416375.268493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416375.397781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416375.537483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416375.655497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416375.798143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416375.920095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416376.049776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416376.198045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416376.308473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416376.436366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416376.577360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416376.708860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416376.835518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416376.956928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416377.089564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416377.219194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416377.348252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416377.491575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416377.603819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416377.722721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416377.856389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416377.984087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416378.112813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416378.240095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416378.365417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416378.496535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416378.630937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416378.773864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416378.898818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416379.029661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416379.164536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416379.291549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416379.422377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416379.543634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416379.672243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416379.797424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416379.952614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416380.079783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416380.231604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416380.347874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416380.477834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416380.597916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416380.734335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416380.861867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416380.994866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416381.129512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416381.270069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416381.411516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416381.542104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416381.677145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416381.787134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416381.933767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416382.085200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416382.205081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416382.343187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416382.474604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416382.613534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416382.737309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416382.851057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416382.985532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416383.115122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416383.254356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416383.375229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416383.516330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416383.642457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416383.774367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416383.923097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416384.046311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416384.169741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416384.295528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416384.435780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416384.544002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416384.677763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416384.808002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416384.942697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416385.079870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416385.218376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416385.347612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416385.478659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416385.602901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416385.728041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416385.854245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416385.982938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416386.106295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416386.235387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416386.366400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416386.504489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416386.639465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416386.778414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416386.898812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416387.023107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416387.160129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416387.311115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416387.412646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416387.552425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416387.667343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416387.795263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416387.937872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416388.058708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416388.186242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416388.331241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416388.462412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416388.603245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416388.727060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416388.859751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416388.989279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416389.119419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416389.247943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416389.380881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416389.520166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416389.638093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416389.789043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416389.923366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416390.043736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416390.167013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416390.300549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416390.426073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416390.544637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416390.667995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416390.799191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416390.937003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416391.058721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416391.187568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416391.325296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416391.462032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416391.586881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416391.744520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416391.854203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416391.985596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416392.109910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416392.247406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416392.380286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416392.501619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416392.641509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416392.787217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416392.912305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416393.041883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416393.163329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416393.287244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416393.415663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416393.539074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416393.664312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416393.801884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416393.935703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416394.060661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416394.206336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416394.332748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416394.473327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416394.620911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416394.732309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416394.853721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416394.988300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416395.128118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416395.249201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416395.380139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416395.502802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416395.635342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416395.776785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416395.919593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416396.063404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416396.207809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416396.333948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416396.461221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416396.590959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416396.735535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416396.847818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416396.982754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416397.106396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416397.234699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416397.357964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416397.480317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416397.612009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416397.735049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416397.857595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416397.995993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416398.124734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416398.256947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416398.399385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416398.517071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416398.651837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416398.795921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416398.919737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416399.047738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416399.192276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416399.330507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416399.455025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416399.599745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416399.721310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416399.851704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416399.975091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416400.107632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416400.232344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416400.359836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416400.489027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416400.603050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416400.736463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416400.864761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416400.987353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416401.118940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416401.255955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416401.378275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416401.519527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416401.649839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416401.783760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416401.943837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416402.048338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416402.175707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416402.308081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416402.451401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416402.583798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416402.725821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416402.851068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416402.995656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416403.100615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416403.228727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416403.371339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416403.499143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416403.611453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416403.753753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416403.874854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416403.998813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416404.135085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416404.285160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416404.415620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416404.539603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416404.663517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416404.791592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416404.918246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416405.043144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416405.170669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416405.297996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416405.425556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416405.549148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416405.683064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416405.813496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416405.937084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416406.087876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416406.215451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416406.363778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416406.469682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416406.601274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416406.722083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416406.852334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416406.975929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416407.105449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416407.228248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416407.372951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416407.485750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416407.612222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416407.747797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416407.888713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416408.016944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416408.164408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416408.289755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416408.435676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416408.542537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416408.672060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416408.800462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416408.933336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416409.061989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416409.191153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416409.318771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416409.468805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416409.589192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416409.726057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416409.846730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416409.976556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416410.099375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416410.228409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416410.343927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416410.478103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416410.671304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416410.808362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416410.937960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416411.064308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416411.203486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416411.347775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416411.480964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416411.609112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416411.734486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416411.861768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416412.019764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416412.149892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416412.287096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416412.422865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416412.549008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416412.681517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416412.807220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416412.961086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416413.083483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416413.222596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416413.363031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416413.479748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416413.613645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416413.728882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416413.869873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416413.998704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416414.137649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416414.252816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416414.382648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416414.527824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416414.653814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416414.796174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416414.915144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416415.047956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416415.191540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416415.309429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416415.436719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416415.593488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416415.740626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416415.855322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416415.974607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416416.110119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416416.225488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416416.359130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416416.505598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416416.632419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416416.765512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416416.909790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416417.037241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416417.165215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416417.289103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416417.419625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416417.543280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416417.672539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416417.799372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416417.927872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416418.050785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416418.181355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416418.321680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416418.458117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416418.577069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416418.715353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416418.839509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416418.997303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416419.103204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416419.235466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416419.369873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416419.482013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416419.609338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416419.736844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416419.865736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416420.021274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416420.143465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416420.271021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416420.394706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416420.530517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416420.651150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416420.775863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416420.908439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416421.041955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416421.164135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416421.310406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416421.416680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416421.560297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416421.666855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416421.792026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416421.918926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416422.049887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416422.185125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416422.324266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416422.454818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416422.588562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416422.715268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416422.856318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416422.969003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416423.104153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416423.244391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416423.373472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416423.498911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416423.622619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416423.757185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416423.905549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416424.034351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416424.160738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416424.283816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416424.417418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416424.539799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416424.661642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416424.788455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416424.919090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416425.039889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416425.194800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416425.306278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416425.456403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416425.560589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416425.690407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416425.832548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416425.962502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416426.089811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416426.216929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416426.356455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416426.487516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416426.594798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416426.715612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416426.845730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416426.982806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416427.110363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416427.236293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416427.363611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416427.490866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416427.620225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416427.763513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416427.888880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416428.018965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416428.152495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416428.286419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416428.413028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416428.541060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416428.665960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416428.809795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416428.917011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416429.048990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416429.175989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416429.310464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416429.435866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416429.566130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416429.705079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416429.843714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416429.966249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416430.092635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416430.224841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416430.357099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416430.476367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416430.602391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416430.724845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416430.861252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416430.976037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416431.106327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416431.250389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416431.360652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416431.496980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416431.619977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416431.760952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416431.907276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416432.021514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416432.145745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416432.279953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416432.413975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416432.545103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416432.670185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416432.797830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416432.935922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416433.065872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416433.203915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416433.340188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416433.465739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416433.591862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416433.722766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416433.857751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416433.984852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416434.110670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416434.246303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416434.369074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416434.513435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416434.645082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416434.780627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416434.901855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416435.036417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416435.160197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416435.285329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416435.408010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416435.549511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416435.658716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416435.792358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416435.922525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416436.046310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416436.170889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416436.304997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416436.432393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416436.562295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416436.688192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416436.818895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416436.951262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416437.095642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416437.222149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416437.359352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416437.478410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416437.613261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416437.750320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416437.891635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416438.026379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416438.154404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416438.279664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416438.413564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416438.529884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416438.680006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416438.785018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416438.922944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416439.041671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416439.166706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416439.294651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416439.427285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416439.559683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416439.689046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416439.831318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416439.977913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416440.108053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416440.231453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416440.362130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416440.487048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416440.608004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416440.767344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416440.862844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416441.022054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416441.142087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416441.276380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416441.407666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416441.538851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416441.664045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416441.797615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416441.956294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416442.093771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416442.212210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416442.356519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416442.471868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416442.603487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416442.728721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416442.872503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416443.003758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416443.122641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416443.260190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416443.390578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416443.519298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416443.644580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416443.775639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416443.933314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416444.066452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416444.215102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416444.341135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416444.466787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416444.598306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416444.723499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416444.847549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416444.981912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416445.106106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416445.236081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416445.362506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416445.489926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416445.626227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416445.756411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416445.896060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416446.031580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416446.152683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416446.278666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416446.405770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416446.528695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416446.670681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416446.794523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416446.925358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416447.049915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416447.181859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416447.314733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416447.440411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416447.580683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416447.720372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416447.893857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416448.055837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416448.202752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416448.329712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416448.464425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416448.592324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416448.716269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416448.845299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416448.974684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416449.097557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416449.242052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416449.356198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416449.483430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416449.609303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416449.741897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416449.877409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416450.018219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416450.148685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416450.274096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416450.405420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416450.535261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416450.653177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416450.784463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416450.905962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416451.040782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416451.162826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416451.291116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416451.417466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416451.550587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416451.686052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416451.826779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416451.939491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416452.087431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416452.210002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416452.345478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416452.471859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416452.601355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416452.725464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416452.855043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416452.977047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416453.107435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416453.225924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416453.358660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416453.482766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416453.613254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416453.748544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416453.871812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416454.001955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416454.144942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416454.266045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416454.402575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416454.535155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416454.665560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416454.789573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416454.925735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416455.045636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416455.176296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416455.307844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416455.439627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416455.574988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416455.705900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416455.843029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416455.984049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416456.109997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416456.246918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416456.387904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416456.516553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416456.650213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416456.778191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416456.898911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416457.036106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416457.164873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416457.293614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416457.413301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416457.551514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416457.670976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416457.799881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416457.931612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416458.057516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416458.200910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416458.308643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416458.442058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416458.588835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416458.707352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416458.842086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416458.963677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416459.111197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416459.240813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416459.356865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416459.480218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416459.607549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416459.732763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416459.866369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416459.999880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416460.142701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416460.265653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416460.415104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416460.545345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416460.692485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416460.821933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416460.947481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416461.072843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416461.210241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416461.344755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416461.478024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416461.603919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416461.732982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416461.858858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416461.997765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416462.122589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416462.266844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416462.400938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416462.531321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416462.652061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416462.784979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416462.908896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416463.039134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416463.163757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416463.294088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416463.428640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416463.537308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416463.665292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416463.810317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416463.925675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416464.057875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416464.183313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416464.317299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416464.453680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416464.605139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416464.718834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416464.851348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416464.976721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416465.105690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416465.234359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416465.365363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416465.487729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416465.619901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416465.747114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416465.899376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416466.013937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416466.158994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416466.288925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416466.413134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416466.544522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416466.671064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416466.795067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416466.916244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416467.061350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416467.174325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416467.294127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416467.434873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416467.558329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416467.685065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416467.819083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416467.954551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416468.085469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416468.211305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416468.343728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416468.476984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416468.603433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416468.732965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416468.868016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416469.000618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416469.151794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416469.288322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416469.406378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416469.537530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416469.665113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416469.789417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416469.910881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416470.042944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416470.166352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416470.294472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416470.420099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416470.556198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416470.686059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416470.825027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416470.955022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416471.100508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416471.224534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416471.375709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416471.483186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416471.629620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416471.735484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416471.868077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416472.031082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416472.145883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416472.283911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416472.419919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416472.541260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416472.670092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416472.793754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416472.935053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416473.052731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416473.206264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416473.308047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416473.448052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416473.585979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416473.717489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416473.847686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416473.981319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416474.105469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416474.246076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416474.369288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416474.494972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416474.627157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416474.758987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416474.891828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416475.044549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416475.167499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416475.297608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416475.436846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416475.571307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416475.686890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416475.827870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416475.940359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416476.086631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416476.217364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416476.350250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416476.474205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416476.595486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416476.725173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416476.851413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416476.974905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416477.111501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416477.242511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416477.356762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416477.480010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416477.625932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416477.744273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416477.871784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416478.014794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416478.140547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416478.278757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416478.409481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416478.530523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416478.670731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416478.793104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416478.939507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416479.044207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416479.181304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416479.307228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416479.447923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416479.578655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416479.703440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416479.844453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416479.991200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416480.102090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416480.230234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416480.344265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416480.481254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416480.608722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416480.737440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416480.860285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416480.996092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416481.133585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416481.254014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416481.403354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416481.525328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416481.655681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416481.790405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416481.909559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416482.041637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416482.165267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416482.303618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416482.430408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416482.562846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416482.691928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416482.816041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416482.945704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416483.082286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416483.210171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416483.346817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416483.473856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416483.606032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416483.719552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416483.870792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416483.979374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416484.110260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416484.235352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416484.371371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416484.497298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416484.648851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416484.766520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416484.904228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416485.036732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416485.163780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416485.287034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416485.434647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416485.550262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416485.676357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416485.812154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416485.943074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416486.070017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416486.224726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416486.361264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416486.475368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416486.603147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416486.741485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416486.858380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416486.983737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416487.104483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416487.234212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416487.358649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416487.493424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416487.622881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416487.762158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416487.891359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416488.036208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416488.152557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416488.286086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416488.408434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416488.539397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416488.663155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416488.787395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416488.923217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416489.063472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416489.167639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416489.308211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416489.429603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416489.566309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416489.707598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416489.832264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416489.974234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416490.189207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416490.415033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416490.683561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416490.985322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416491.353250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416491.642054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416491.987411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416492.279294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416492.560317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416492.855191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416493.080183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416493.236354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416493.430556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416493.638541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416493.831766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416493.998517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416494.171463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416494.348301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416494.537538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416494.685092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416494.875712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416495.034348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416495.188007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416495.389035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416495.558152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416495.727909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416495.927337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416496.056639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416496.244491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416496.456415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416496.611517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416496.793198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416496.948467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416497.110795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416497.295133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416497.503040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416497.669152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416497.836245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416498.052649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416498.335718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416498.515112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416498.656268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416498.804361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416498.953066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416499.108341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416499.291282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416499.444929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416499.603704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416499.756652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416500.068354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416500.316420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416500.494617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416500.628552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416500.759969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416500.912585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416501.042694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416501.227608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416501.417564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416501.580235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416501.729330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416501.902012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416502.117515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416502.332356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416502.516993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416502.680323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416502.830300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416503.045232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416503.213168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416503.405545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416503.543967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416503.737753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416503.885588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416504.035298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416504.204985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416504.372298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416504.556834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416504.771477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416504.918962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416505.101948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416505.302504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416505.527058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416505.852343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416506.082174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416506.219366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416506.346541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416506.495448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416506.620307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416506.743477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416506.867783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416507.001046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416507.122322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416507.243647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416507.401320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416507.518479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416507.646859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416507.771250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416507.929102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416508.044784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416508.182417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416508.312066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416508.498729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416508.702822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416508.839758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416508.974026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416509.095268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416509.227697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416509.350246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416509.492140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416509.619645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416509.740716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416509.871771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416510.015320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416510.156804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416510.292129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416510.412427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416510.545062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416510.669799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416510.797056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416510.939275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416511.062994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416511.188595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416511.332452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416511.465054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416511.588907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416511.723430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416511.848867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416511.975954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416512.099549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416512.226070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416512.355481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416512.483287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416512.618533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416512.744283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416512.878698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416513.015526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416513.158342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416513.278338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416513.406761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416513.532744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416513.680614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416513.803699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416513.930437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416514.078743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416514.203723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416514.328635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416514.489066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416514.600513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416514.732425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416514.848350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416514.975666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416515.099297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416515.241681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416515.354593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416515.482250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416515.615435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416515.747107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416515.926494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416516.041486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416516.167754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416516.299153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416516.424260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416516.558730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416516.683098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416516.812762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416516.960046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416517.084449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416517.216686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416517.349361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416517.481253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416517.596278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416517.725648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416517.857470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416517.975176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416518.095944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416518.227595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416518.353710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416518.479639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416518.622106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416518.749586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416518.887486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416519.014994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416519.155973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416519.284860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416519.412808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416519.545753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416519.661732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416519.786683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416519.924646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416520.055227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416520.197369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416520.320743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416520.467621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416520.584924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416520.719705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416520.848161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416520.978635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416521.102536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416521.231443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416521.350227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416521.492358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416521.600141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416521.732154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416521.857482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416521.989706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416522.120454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416522.246647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416522.386406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416522.506735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416522.637523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416522.764817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416522.901111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416523.032047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416523.158315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416523.286419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416523.415160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416523.545342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416523.683750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416523.805658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416523.932807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416524.079212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416524.204930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416524.359217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416524.460063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416524.599469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416524.722531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416524.852725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416524.981492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416525.121237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416525.244493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416525.389484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416525.517186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416525.663306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416525.782426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416525.920856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416526.045664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416526.175616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416526.312387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416526.445196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416526.570595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416526.707389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416526.842162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416526.994220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416527.142740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416527.279132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416527.401264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416527.542829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416527.658636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416527.806612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416527.919434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416528.047485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416528.184828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416528.302971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416528.434935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416528.575507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416528.687473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416528.819536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416528.954820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416529.076733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416529.216813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416529.349768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416529.475728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416529.606164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416529.722380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416529.856955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416529.979630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416530.110671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416530.235651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416530.366106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416530.484815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416530.616658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416530.766493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416530.893705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416531.024428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416531.169906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416531.284022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416531.431725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416531.542093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416531.668527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416531.788979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416531.917717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416532.069601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416532.224311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416532.345403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416532.473753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416532.600290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416532.728213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416532.855384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416533.029733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416533.140711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416533.287760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416533.405592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416533.524561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416533.650494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416533.796473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416533.910694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416534.046210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416534.168374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416534.296556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416534.419317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416534.553823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416534.678263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416534.805331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416534.948384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416535.084827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416535.205317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416535.320505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416535.461198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416535.595332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416535.724092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416535.844476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416535.977993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416536.101121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416536.244395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416536.368989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416536.479927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416536.609720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416536.732157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416536.866290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416536.993053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416537.139179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416537.249556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416537.396231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416537.518161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416537.664652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416537.781024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416537.912355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416538.037322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416538.164872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416538.304288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416538.423472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416538.550626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416538.679377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416538.808411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416538.943472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416539.076135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416539.218635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416539.340952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416539.470082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416539.596968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416539.725924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416539.850774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416539.981823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416540.114194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416540.263989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416540.372275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416540.527447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416540.653095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416540.778146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416540.900688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416541.029572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416541.164102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416541.296779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416541.429199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416541.563665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416541.682046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416541.818666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416541.942360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416542.088805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416542.208755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416542.346849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416542.475756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416542.600673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416542.725989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416542.851258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416542.973175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416543.102792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416543.234474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416543.358900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416543.481136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416543.607341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416543.731854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416543.869543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416543.997272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416544.135770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416544.278830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416544.411610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416544.526830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416544.659042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416544.786651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416544.909232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416545.032046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416545.166195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416545.295536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416545.423292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416545.570992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416545.684293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416545.823531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416545.951982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416546.085023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416546.224895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416546.344237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416546.476181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416546.597453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416546.724301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416546.859800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416546.974306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416547.099547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416547.234690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416547.351151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416547.484376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416547.619127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416547.753730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416547.894527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416548.033750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416548.148383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416548.286911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416548.405135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416548.539120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416548.677094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416548.789521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416548.914253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416549.045530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416549.172680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416549.302603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416549.431608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416549.576123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416549.705471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416549.837147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416549.957293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416550.080800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416550.213924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416550.344741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416550.470212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416550.615406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416550.727383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416550.857763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416551.079175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416551.244173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416551.384709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416551.514438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416551.642632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416551.775762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416551.922635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416552.055146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416552.182469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416552.299117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416552.431119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416552.574210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416552.705070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416552.832648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416552.968964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416553.087390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416553.225017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416553.346494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416553.479980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416553.610840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416553.744276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416553.853754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416553.982303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416554.107508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416554.243701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416554.368766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416554.506094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416554.631694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416554.774894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416554.896403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416555.027932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416555.153961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416555.290908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416555.420064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416555.557951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416555.665278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416555.794477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416555.914902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416556.043474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416556.172628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416556.318256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416556.450060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416556.608986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416556.761207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416556.889252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416557.013853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416557.154901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416557.290997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416557.411885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416557.529155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416557.666903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416557.795376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416557.920072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416558.048370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416558.191879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416558.323834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416558.463351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416558.582959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416558.713901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416558.847998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416558.974357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416559.097303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416559.231735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416559.368106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416559.511061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416559.630504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416559.779374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416559.933224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416560.071593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416560.197070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416560.325679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416560.460737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416560.596201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416560.722704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416560.846340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416560.965417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416561.105145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416561.226764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416561.354944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416561.482531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416561.641806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416561.762774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416561.907090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416562.060035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416562.182863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416562.305229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416562.471670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416562.586111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416562.708755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416562.847307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416562.980985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416563.106959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416563.227074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416563.355930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416563.481295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416563.602186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416563.729715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416563.867397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416564.014781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416564.141948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416564.269697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416564.409566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416564.532878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416564.664609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416564.781028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416564.929918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416565.038880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416565.157843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416565.299617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416565.408235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416565.559160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416565.660400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416565.799785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416565.935392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416566.049730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416566.170795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416566.304650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416566.446223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416566.563037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416566.702634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416566.842311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416566.973370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416567.092931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416567.233884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416567.348296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416567.472243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416567.608312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416567.728869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416567.849753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416568.020236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416568.152929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416568.270720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416568.396754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416568.527277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416568.655870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416568.777730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416568.916492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416569.039988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416569.181484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416569.304493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416569.435044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416569.578314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416569.706714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416569.834621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416569.973591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416570.093896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416570.225311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416570.346485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416570.478136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416570.600839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416570.744505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416570.866315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416570.981036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416571.115337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416571.264402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416571.391559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416571.530688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416571.655210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416571.789138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416571.898125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416572.032700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416572.158055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416572.286547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416572.405673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416572.551793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416572.655482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416572.794320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416572.915400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416573.043340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416573.161553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416573.305287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416573.428100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416573.548195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416573.698264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416573.821131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416573.966489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416574.109952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416574.223943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416574.349029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416574.477811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416574.604746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416574.729245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416574.868372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416574.995529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416575.129782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416575.272487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416575.405094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416575.522880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416575.660368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416575.778676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416575.921946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416576.051807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416576.205543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416576.328806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416576.458616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416576.590371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416576.730708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416576.852730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416576.992783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416577.115825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416577.244647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416577.383748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416577.515239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416577.643756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416577.790730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416577.905899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416578.038509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416578.159473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416578.292131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416578.416588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416578.554119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416578.677451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416578.802061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416578.941272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416579.079805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416579.208860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416579.345625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416579.464433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416579.598849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416579.718607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416579.845883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416579.972247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416580.105580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416580.239360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416580.386718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416580.495048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416580.615915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416580.759210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416580.901558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416581.022503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416581.164128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416581.279466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416581.412901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416581.536687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416581.667449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416581.793005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416581.919874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416582.058133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416582.178374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416582.308551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416582.463023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416582.582630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416582.706433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416582.831707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416582.969829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416583.085283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416583.218837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416583.341012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416583.477654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416583.601559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416583.734562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416583.864671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416583.983332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416584.116929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416584.244195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416584.374397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416584.533502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416584.657855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416584.784328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416584.908296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416585.034611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416585.156179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416585.282065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416585.406343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416585.544342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416585.659619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416585.789469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416585.925064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416586.044208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416586.166747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416586.359109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416586.616060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416586.804807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416587.032646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416587.146653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416587.272727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416587.396062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416587.523533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416587.644040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416587.767409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416587.906803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416588.029191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416588.155050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416588.281110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416588.404618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416588.535091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416588.659858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416588.792048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416588.915566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416589.052976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416589.191772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416589.324822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416589.448012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416589.595699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416589.716246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416589.841716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416589.967548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416590.093925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416590.222072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416590.346876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416590.475918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416590.624319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416590.744348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416590.872590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416591.011400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416591.162437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416591.277154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416591.412886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416591.538647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416591.676964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416591.802565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416591.949566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416592.090749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416592.223036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416592.353513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416592.487757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416592.613846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416592.740066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416592.876645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416593.033650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416593.161848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416593.285253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416593.408885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416593.539831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416593.682170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416593.808446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416593.946230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416594.088408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416594.215051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416594.338810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416594.465103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416594.593169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416594.718671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416594.849543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416594.973841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416595.105209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416595.233535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416595.363568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416595.494360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416595.622775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416595.759842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416595.903501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416596.044953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416596.161268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416596.284773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416596.411738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416596.541854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416596.666368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416596.792007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416596.926888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416597.052336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416597.178035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416597.321564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416597.461281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416597.582270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416597.718622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416597.833359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416597.968937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416598.101145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416598.220278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416598.345471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416598.487003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416598.591797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416598.720213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416598.851701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416598.977312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416599.099635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416599.230749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416599.368278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416599.514785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416599.654714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416599.763663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416599.889586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416600.014809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416600.144825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416600.277844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416600.405720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416600.535553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416600.663539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416600.789541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416600.915179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416601.039882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416601.179280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416601.299440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416601.427138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416601.562408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416601.688016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416601.822673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416601.951182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416602.093741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416602.209106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416602.344412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416602.473877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416602.616817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416602.723033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416602.868929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416602.989505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416603.107637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416603.229004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416603.354210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416603.491377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416603.618270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416603.757734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416603.894537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416604.017808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416604.156458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416604.275595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416604.408224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416604.538378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416604.657439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416604.785173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416604.906731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416605.031214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416605.164459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416605.288668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416605.420839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416605.550639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416605.680525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416605.815445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416605.934227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416606.092242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416606.217262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416606.336726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416606.462394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416606.583625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416606.717691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416606.840001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416606.986005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416607.099327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416607.212099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416607.346750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416607.475100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416607.602296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416607.734168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416607.863836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416607.993671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416608.131413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416608.281137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416608.388559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416608.512276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416608.649731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416608.790730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416608.912606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416609.038955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416609.159688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416609.290438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416609.404810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416609.535522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416609.666497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416609.802528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416609.940293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416610.073991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416610.206382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416610.337106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416610.469562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416610.592140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416610.712900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416610.836580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416610.959066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416611.095519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416611.216878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416611.347835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416611.470374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416611.599222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416611.725670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416611.869117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416611.994971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416612.131960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416612.263517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416612.401626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416612.521663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416612.657403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416612.796055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416612.910860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416613.036724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416613.167902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416613.299944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416613.430869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416613.552381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416613.685131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416613.824775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416613.969791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416614.101983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416614.239468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416614.347616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416614.478427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416614.604720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416614.730392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416614.850820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416614.974113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416615.105509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416615.238132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416615.359281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416615.487573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416615.616710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416615.748971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416615.881205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416616.032249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416616.156368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416616.285448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416616.409748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416616.552222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416616.663469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416616.802426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416616.930068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416617.067564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416617.196795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416617.343329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416617.468123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416617.598754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416617.736540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416617.864313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416617.990473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416618.124865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416618.262430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416618.384070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416618.516892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416618.651422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416618.779448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416618.910375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416619.035094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416619.159973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416619.290307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416619.415701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416619.539194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416619.681279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416619.792531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416620.021244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416620.186998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416620.324157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416620.452848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416620.583972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416620.708414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416620.853979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416620.970719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416621.106660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416621.228388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416621.355664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416621.489872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416621.633170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416621.758723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416621.895803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416622.074835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416622.203965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416622.325114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416622.468085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416622.587111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416622.720008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416622.848086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416622.973759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416623.096603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416623.224517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416623.357044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416623.486837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416623.601915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416623.737316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416623.847435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416623.990581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416624.135257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416624.274146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416624.402597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416624.533411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416624.661029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416624.784030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416624.909719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416625.039457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416625.163803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416625.291760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416625.419216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416625.549713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416625.693676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416625.808668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416625.936792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416626.094756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416626.217288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416626.353961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416626.480844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416626.607932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416626.746443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416626.860956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416627.002624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416627.138644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416627.275760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416627.408029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416627.537713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416627.659538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416627.789160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416627.931246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416628.058499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416628.191849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416628.329623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416628.454133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416628.595343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416628.726964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416628.849890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416628.978050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416629.116051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416629.247561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416629.386446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416629.538380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416629.665968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416629.791827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416629.915730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416630.044650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416630.189412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416630.302858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416630.427896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416630.574113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416630.705307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416630.839198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416630.966645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416631.088792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416631.217807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416631.345969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416631.487949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416631.604116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416631.727392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416631.860487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416631.997608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416632.129994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416632.266968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416632.400316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416632.535795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416632.682599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416632.808803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416632.957294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416633.085555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416633.211733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416633.334034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416633.465909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416633.589046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416633.722690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416633.843865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416633.970267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416634.091230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416634.221653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416634.345773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416634.470811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416634.595232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416634.725627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416634.851822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416634.978571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416635.112936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416635.253185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416635.380981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416635.518749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416635.641809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416635.772141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416635.908019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416636.040171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416636.164806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416636.293565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416636.428830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416636.573690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416636.702091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416636.843264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416636.982527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416637.121537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416637.243880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416637.354920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416637.498700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416637.626244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416637.762170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416637.909898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416638.018022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416638.146714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416638.284034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416638.416964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416638.534847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416638.665591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416638.788586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416638.924970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416639.071363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416639.204094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416639.322265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416639.451367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416639.589926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416639.722049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416639.839935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416639.977730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416640.095426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416640.226416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416640.364609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416640.482804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416640.616266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416640.751811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416640.883331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416641.036836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416641.159226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416641.282834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416641.409458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416641.538045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416641.663017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416641.800792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416641.930826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416642.070824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416642.196071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416642.329420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416642.456706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416642.591766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416642.707923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416642.844266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416642.970308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416643.103167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416643.225547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416643.383722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416643.501944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416643.638364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416643.764673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416643.892874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416644.014416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416644.144358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416644.280917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416644.414101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416644.533537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416644.660976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416644.808016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416644.915657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416645.035920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416645.177701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416645.333117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416645.469519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416645.590288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416645.722200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416645.845331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416645.962803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416646.088990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416646.219043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416646.339922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416646.469781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416646.591477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416646.717332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416646.843625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416646.986078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416647.095722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416647.229112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416647.356079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416647.489440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416647.615613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416647.761343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416647.892233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416648.017912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416648.147767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416648.282660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416648.406601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416648.533515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416648.664411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416648.789518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416648.915746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416649.048149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416649.173359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416649.305373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416649.430544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416649.571585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416649.702990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416649.844777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416649.967490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416650.113332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416650.219946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416650.360033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416650.480573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416650.623264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416650.738878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416650.868271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416651.025222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416651.138960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416651.274629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416651.412498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416651.528018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416651.680018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416651.790040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416651.932105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416652.068396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416652.200088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416652.338576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416652.469565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416652.595317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416652.731165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416652.853863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416652.977680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416653.101186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416653.230801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416653.356701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416653.496229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416653.680519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416653.825954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416653.940344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416654.060042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416654.213252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416654.344310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416654.461025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416654.599980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416654.717015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416654.849436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416654.972605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416655.093579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416655.222249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416655.352542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416655.480029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416655.611786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416655.737209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416655.887397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416656.002181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416656.140863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416656.281639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416656.409969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416656.540383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416656.657251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416656.772612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416656.902979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416657.050534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416657.158732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416657.288421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416657.415892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416657.534594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416657.669118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416657.791357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416657.943073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416658.063734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416658.195242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416658.330569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416658.486892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416658.596907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416658.732477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416658.845754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416658.965355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416659.088271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416659.221226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416659.345592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416659.472425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416659.594725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416659.719387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416659.845485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416659.979166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416660.106927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416660.247477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416660.381118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416660.524138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416660.642975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416660.774590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416660.905653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416661.030242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416661.156461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416661.297642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416661.422440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416661.572054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416661.677806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416661.822031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416661.945520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416662.093273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416662.210915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416662.345603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416662.468798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416662.597092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416662.718699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416662.843118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416662.989974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416663.105332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416663.235463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416663.374646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416663.506461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416663.647217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416663.767207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416663.903057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416664.028835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416664.166100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416664.283133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416664.432217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416664.539514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416664.679056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416664.810383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416664.948816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416665.074647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416665.219956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416665.353549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416665.473964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416665.597072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416665.723470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416665.859989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416665.994169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416666.129860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416666.289842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416666.414605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416666.536546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416666.664381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416666.791445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416666.915321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416667.049488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416667.178904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416667.325166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416667.444583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416667.581140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416667.713803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416667.857314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416667.964381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416668.099447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416668.224082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416668.352612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416668.479373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416668.615164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416668.740080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416668.888840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416669.006322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416669.137904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416669.264376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416669.397647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416669.525402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416669.651789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416669.778510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416669.924571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416670.032025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416670.165599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416670.289138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416670.417895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416670.546544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416670.699269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416670.975650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416671.277074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416671.528003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416671.984339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416672.338069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416672.720694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416673.142009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416673.362324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416673.534482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416673.779301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416673.975826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416674.162782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416674.350451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416674.528224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416674.675340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416674.847746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416675.001317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416675.168593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416675.347378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416675.521901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416675.701595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416675.895624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416676.055101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416676.214235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416676.384574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416676.550729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416676.716324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416676.901322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416677.109217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416677.265408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416677.421307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416677.612642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416677.796097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416678.000736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416678.154266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416678.305345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416678.545797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416678.664153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416678.924549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416679.103608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416679.278846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416679.450126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416679.639077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416679.805988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416680.008263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416680.136352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416680.310622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416680.462156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416680.765141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416681.034224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416681.204860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416681.343332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416681.478570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416681.610898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416681.752536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416681.922202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416682.102625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416682.283015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416682.456723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416682.637355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416682.836063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416682.984354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416683.162656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416683.341060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416683.531039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416683.678742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416683.846241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416684.052815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416684.244853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416684.396702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416684.575718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416684.778803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416684.965539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416685.109448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416685.300218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416685.486120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416685.671041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416685.848243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416686.009352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416686.168479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416686.538004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416686.802449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416687.015328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416687.171715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416687.288800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416687.420333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416687.552217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416687.673883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416687.809221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416687.962391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416688.082456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416688.212564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416688.340748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416688.469746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416688.593653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416688.736604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416688.844240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416688.973918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416689.103308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416689.243211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416689.440365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416689.628600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416689.754853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416689.897933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416690.016465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416690.153072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416690.280722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416690.422773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416690.523961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416690.656298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416690.774167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416690.909693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416691.036437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416691.174342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416691.303041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416691.429617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416691.558432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416691.703852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416691.829056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416691.962540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416692.079473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416692.215442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416692.342744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416692.467507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416692.584799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416692.720721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416692.833180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416692.975633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416693.087913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416693.218863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416693.350472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416693.476467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416693.599047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416693.740910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416693.860620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416693.987293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416694.128658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416694.252705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416694.388208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416694.536665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416694.654214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416694.797244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416694.908908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416695.052136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416695.160399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416695.294636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416695.434773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416695.592611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416695.727927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416695.843724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416695.977596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416696.136612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416696.241119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416696.391600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416696.512618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416696.650552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416696.777943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416696.914393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416697.032587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416697.165725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416697.290978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416697.441143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416697.564435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416697.697098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416697.834707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416697.959906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416698.080707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416698.216731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416698.339859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416698.464803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416698.599688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416698.728226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416698.859947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416698.997769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416699.111289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416699.246071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416699.382641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416699.518489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416699.654803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416699.781291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416699.923684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416700.046831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416700.165686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416700.297883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416700.427300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416700.558719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416700.693691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416700.857849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416700.964571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416701.094277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416701.221280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416701.352884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416701.486830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416701.607931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416701.748646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416701.882702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416702.013484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416702.148522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416702.272482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416702.398215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416702.518854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416702.649277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416702.777854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416702.910080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416703.034313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416703.168210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416703.292894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416703.415556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416703.551943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416703.695855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416703.835129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416703.971636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416704.094589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416704.223681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416704.350072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416704.485044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416704.610133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416704.754661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416704.881250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416705.012902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416705.150712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416705.279339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416705.404841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416705.579751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416705.718287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416705.870770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416706.000813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416706.146537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416706.264919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416706.396060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416706.520324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416706.652693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416706.793311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416706.916778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416707.039007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416707.184938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416707.323190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416707.451891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416707.582411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416707.718006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416707.844443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416707.996156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416708.111808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416708.249048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416708.386887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416708.529691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416708.652252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416708.784899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416708.910427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416709.059205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416709.182133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416709.321154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416709.450233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416709.588690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416709.708708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416709.839349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416709.969595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416710.098166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416710.221696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416710.349911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416710.473988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416710.607285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416710.738223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416710.877300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416711.008868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416711.151901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416711.278148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416711.407589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416711.549615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416711.662617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416711.789187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416711.925522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416712.088878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416712.215420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416712.342396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416712.466808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416712.608728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416712.714283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416712.839190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416712.974156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416713.093937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416713.232841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416713.358522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416713.485416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416713.611333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416713.755113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416713.882299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416714.055856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416714.221507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416714.351972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416714.483577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416714.632428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416714.759262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416714.903237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416715.024364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416715.157985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416715.280551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416715.402476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416715.528333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416715.659803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416715.787204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416715.909513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416716.034219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416716.179653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416716.301752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416716.447542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416716.557410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416716.700941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416716.826809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416716.948609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416717.093306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416717.223407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416717.352943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416717.476118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416717.599745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416717.736665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416717.861491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416718.006333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416718.121803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416718.263386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416718.387957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416718.530803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416718.650152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416718.787528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416718.899884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416719.026995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416719.159842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416719.288839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416719.404583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416719.540442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416719.669989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416719.783401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416719.917428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416720.064870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416720.202257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416720.350854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416720.461759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416720.596305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416720.737306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416720.858916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416720.978749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416721.113224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416721.236551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416721.374313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416721.514601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416721.648378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416721.784644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416721.907933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416722.038945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416722.173914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416722.301469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416722.436022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416722.570496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416722.698035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416722.835252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416722.974393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416723.081659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416723.213453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416723.360432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416723.474553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416723.593177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416723.720547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416723.852207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416723.988005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416724.113282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416724.242350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416724.372670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416724.517543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416724.653072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416724.788049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416724.904821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416725.035606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416725.163990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416725.306394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416725.429641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416725.544979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416725.668117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416725.796690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416725.920648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416726.047457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416726.175834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416726.327009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416726.450301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416726.592437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416726.715379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416726.847744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416726.983068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416727.093915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416727.220215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416727.347479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416727.465763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416727.596403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416727.725340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416727.864693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416727.986442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416728.121116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416728.245340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416728.385282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416728.518653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416728.655878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416728.783423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416728.919201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416729.044469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416729.164567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416729.307951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416729.438550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416729.544021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416729.679977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416729.818790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416729.955458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416730.082284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416730.234837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416730.345366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416730.476795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416730.603925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416730.738447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416730.864910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416731.008058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416731.137515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416731.286361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416731.403451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416731.603131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416731.801778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416731.925859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416732.052750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416732.199605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416732.337605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416732.468116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416732.593562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416732.724189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416732.848087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416732.980282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416733.106507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416733.249550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416733.370148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416733.533539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416733.644069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416733.773577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416733.914183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416734.047186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416734.171844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416734.312841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416734.457687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416734.591665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416734.720881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416734.844501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416734.968811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416735.095784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416735.214623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416735.348523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416735.475355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416735.602943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416735.740866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416735.884715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416736.008189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416736.154956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416736.281834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416736.424505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416736.531351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416736.663969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416736.790796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416736.921796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416737.046642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416737.185251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416737.333860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416737.457310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416737.591041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416737.717019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416737.861349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416737.985808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416738.107364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416738.238694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416738.374042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416738.507436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416738.649117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416738.774186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416738.890049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416739.030259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416739.151788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416739.282432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416739.422060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416739.545645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416739.680577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416739.811608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416739.964371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416740.096548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416740.238056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416740.358058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416740.489515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416740.635080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416740.765142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416740.919384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416741.046593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416741.179426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416741.321608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416741.448007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416741.581541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416741.715045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416741.844621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416742.018498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416742.150113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416742.280703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416742.404406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416742.530975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416742.652438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416742.791295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416742.924793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416743.054948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416743.172921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416743.317781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416743.449017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416743.582906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416743.714782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416743.869296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416743.996810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416744.127685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416744.260608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416744.398436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416744.520657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416744.655540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416744.786637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416744.903422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416745.031706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416745.158357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416745.291159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416745.415218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416745.537704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416745.685706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416745.800075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416745.927429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416746.060801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416746.205060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416746.326785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416746.457532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416746.589879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416746.720215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416746.841895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416746.966848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416747.107723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416747.226040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416747.356740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416747.479138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416747.615968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416747.754971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416747.903217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416748.029174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416748.154739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416748.296733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416748.423551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416748.573861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416748.694210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416748.829960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416748.966323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416749.096138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416749.218022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416749.356280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416749.487666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416749.606841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416749.736868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416749.870173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416750.019137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416750.166761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416750.279164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416750.440505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416750.527282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416750.675378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416750.801803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416750.915202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416751.038714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416751.169722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416751.297899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416751.440172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416751.571792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416751.719726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416751.845339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416751.989012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416752.095975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416752.218536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416752.351878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416752.504448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416752.613751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416752.742667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416752.872885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416753.018978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416753.146466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416753.277714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416753.395502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416753.531761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416753.654382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416753.787713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416753.913741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416754.048547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416754.176828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416754.328193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416754.449099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416754.608206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416754.721060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416754.852802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416754.975634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416755.107449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416755.242926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416755.390568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416755.511794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416755.653640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416755.782063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416755.932610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416756.067279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416756.198780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416756.324577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416756.456133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416756.578802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416756.715886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416756.836698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416756.969342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416757.090907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416757.238566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416757.345247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416757.477466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416757.597527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416757.748076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416757.869069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416758.006931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416758.140496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416758.280310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416758.397731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416758.531423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416758.654547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416758.781749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416758.913625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416759.046304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416759.173311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416759.324722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416759.462452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416759.589296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416759.709606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416759.853768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416759.984574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416760.118391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416760.221962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416760.360092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416760.483959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416760.623402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416760.773856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416760.922201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416761.029792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416761.160292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416761.284655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416761.421950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416761.545591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416761.679355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416761.822575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416761.944607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416762.078524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416762.228864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416762.333342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416762.473824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416762.599934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416762.725488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416762.853586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416762.983191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416763.134553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416763.272993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416763.400271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416763.528628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416763.658902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416763.793491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416763.935936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416764.072112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416764.205942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416764.338214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416764.460857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416764.608775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416764.709572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416764.843783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416764.971043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416765.108464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416765.243163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416765.382890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416765.549037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416765.827911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416766.002103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416766.151553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416766.291614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416766.461643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416766.607528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416766.754755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416766.907307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416767.049737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416767.197191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416767.351186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416767.509089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416767.686353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416767.842710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416767.989168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416768.138876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416768.334236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416768.481605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416768.597409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416768.742793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416768.903977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416769.069018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416769.166140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416769.323204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416769.545099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416769.735205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416769.946264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416770.090222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416770.240911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416770.418501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416770.549237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416770.716098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416770.891160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416771.024394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416771.152135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416771.277808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416771.406116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416771.533870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416771.674637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416771.804163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416771.965729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416772.092434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416772.223988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416772.350768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416772.477890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416772.612086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416772.741758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416772.883817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416773.022660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416773.148821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416773.279586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416773.398160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416773.534498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416773.662041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416773.801318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416773.942163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416774.090567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416774.217872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416774.348790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416774.485920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416774.606158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416774.727335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416774.863644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416774.974291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416775.112014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416775.228761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416775.360100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416775.491357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416775.640440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416775.776724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416775.911353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416776.035928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416776.171721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416776.297778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416776.445120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416776.573852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416776.714109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416776.837976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416776.980403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416777.087130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416777.232977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416777.341983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416777.472693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416777.609980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416777.728427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416777.849246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416777.998649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416778.128000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416778.247070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416778.376284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416778.509066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416778.638118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416778.778826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416778.924741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416779.045353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416779.170507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416779.318574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416779.438844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416779.573107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416779.704923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416779.843029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416779.968128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416780.100651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416780.225351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416780.353714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416780.484384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416780.625614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416780.749623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416780.896468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416781.029360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416781.170912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416781.295505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416781.405110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416781.548919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416781.686590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416781.796221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416781.935060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416782.158484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416782.284043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416782.413863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416782.545777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416782.693338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416782.806434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416782.948911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416783.070010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416783.216356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416783.339895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416783.479092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416783.596283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416783.723441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416783.848878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416783.983361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416784.109338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416784.247822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416784.382144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416784.510943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416784.639318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416784.773324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416784.904217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416785.034039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416785.161191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416785.293025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416785.423042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416785.553676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416785.696126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416785.840279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416785.954789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416786.110438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416786.218647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416786.353462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416786.476731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416786.607801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416786.735188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416786.880241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416787.007183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416787.143767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416787.271114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416787.415557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416787.526270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416787.648169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416787.777268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416787.905323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416788.033884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416788.162599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416788.287606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416788.431419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416788.555084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416788.704598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416788.825112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416788.944106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416789.082558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416789.220500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416789.336953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416789.466010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416789.596828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416789.721524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416789.847512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416789.982373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416790.112192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416790.254564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416790.379955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416790.530406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416790.643994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416790.775050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416790.904194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416791.031915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416791.149360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416791.284141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416791.411672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416791.554060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416791.679016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416791.814824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416791.944000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416792.090906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416792.207785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416792.341336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416792.466301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416792.596800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416792.730442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416792.851583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416792.982301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416793.106893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416793.252327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416793.378515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416793.507486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416793.645059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416793.770906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416793.902456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416794.027926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416794.161001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416794.277150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416794.408947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416794.540303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416794.688049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416794.826450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416794.953696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416795.087394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416795.217753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416795.345757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416795.485556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416795.612573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416795.731242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416795.880491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416796.018320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416796.153346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416796.272899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416796.407759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416796.534884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416796.653932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416796.790781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416796.910183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416797.038392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416797.161455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416797.287438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416797.420473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416797.555617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416797.692218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416797.820947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416797.959796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416798.096531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416798.220710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416798.349272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416798.498001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416798.632080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416798.764182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416798.905174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416799.025085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416799.159478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416799.279342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416799.408497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416799.533417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416799.674544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416799.793867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416799.943831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416800.072951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416800.211150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416800.336673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416800.466849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416800.591279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416800.739952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416800.847625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416801.003052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416801.145207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416801.277274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416801.409743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416801.555033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416801.671526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416801.819378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416801.974515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416802.110778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416802.231775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416802.365043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416802.506909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416802.652108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416802.776514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416802.917334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416803.036351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416803.161792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416803.299746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416803.442764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416803.580770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416803.707819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416803.850241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416803.983643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416804.123644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416804.235309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416804.365769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416804.488876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416804.620081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416804.765168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416804.887047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416805.028829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416805.151902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416805.273936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416805.417440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416805.529546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416805.651558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416805.781893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416805.900214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416806.030029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416806.157551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416806.293668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416806.419563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416806.555553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416806.692051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416806.822150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416806.956522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416807.082034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416807.211380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416807.337245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416807.479076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416807.587498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416807.727302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416807.858152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416807.976275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416808.115036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416808.242332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416808.372684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416808.506246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416808.636694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416808.763010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416808.890502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416809.021634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416809.172211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416809.288623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416809.418545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416809.539184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416809.665332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416809.797175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416809.942503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416810.077024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416810.213490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416810.338349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416810.472055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416810.590334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416810.726157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416810.846148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416810.980168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416811.118574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416811.254113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416811.385862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416811.508039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416811.647341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416811.779641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416811.900459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416812.029891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416812.157574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416812.285014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416812.411713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416812.538432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416812.667939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416812.800527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416812.936695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416813.069000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416813.197744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416813.335026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416813.455602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416813.587875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416813.711371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416813.843849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416813.965894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416814.099517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416814.232407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416814.357970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416814.504065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416814.637897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416814.765582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416814.898595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416815.011375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416815.145274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416815.277016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416815.459428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416815.613179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416815.766859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416815.889688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416816.027798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416816.155692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416816.283908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416816.408176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416816.536153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416816.669814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416816.814873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416816.939227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416817.073749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416817.202631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416817.332242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416817.456068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416817.589444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416817.720022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416817.843529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416817.972803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416818.093507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416818.226524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416818.361875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416818.495912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416818.650270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416818.765595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416818.895909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416819.022100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416819.151499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416819.282304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416819.412424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416819.521173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416819.653301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416819.779237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416819.913572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416820.061749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416820.184791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416820.320386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416820.464073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416820.580785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416820.707572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416820.841120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416820.967960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416821.111408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416821.225961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416821.357828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416821.498023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416821.626878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416821.757905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416821.904165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416822.030647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416822.158690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416822.293343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416822.433161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416822.546954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416822.691623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416822.819818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416822.950523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416823.084668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416823.211106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416823.340994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416823.469677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416823.608362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416823.736347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416823.875611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416824.005575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416824.148659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416824.269645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416824.395571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416824.523707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416824.667835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416824.787470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416824.926489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416825.033756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416825.174117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416825.298607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416825.436259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416825.571548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416825.692774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416825.818820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416825.952141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416826.089018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416826.226708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416826.353739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416826.486519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416826.595289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416826.723195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416826.856499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416826.982375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416827.120183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416827.266185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416827.390734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416827.516952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416827.644847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416827.771425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416827.909520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416828.034932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416828.166992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416828.296668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416828.430342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416828.564866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416828.697791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416828.830744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416828.953228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416829.091313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416829.234537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416829.341974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416829.475660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416829.595133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416829.723459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416829.859233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416829.985154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416830.124743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416830.249061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416830.385868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416830.506903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416830.639384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416830.768645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416830.893755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416831.027352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416831.155578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416831.301018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416831.413810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416831.544051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416831.693710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416831.816148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416831.981584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416832.094443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416832.223286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416832.351266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416832.488076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416832.623794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416832.734580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416832.885602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416833.016470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416833.135803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416833.270584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416833.396652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416833.526523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416833.648213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416833.783213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416833.916890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416834.041000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416834.180551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416834.316651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416834.455350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416834.588229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416834.706610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416834.849644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416834.967024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416835.088671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416835.216493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416835.350503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416835.472677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416835.603082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416835.729363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416835.856099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416835.986589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416836.121721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416836.263276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416836.412972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416836.529721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416836.656761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416836.780298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416836.917463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416837.042278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416837.191404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416837.326618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416837.464897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416837.590285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416837.710370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416837.845056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416837.964361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416838.090833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416838.215160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416838.344061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416838.472480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416838.593618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416838.739081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416838.840824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416838.968807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416839.096908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416839.241779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416839.373644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416839.502782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416839.635875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416839.769834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416839.909163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416840.035178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416840.162577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416840.289712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416840.419596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416840.552934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416840.692603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416840.835363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416840.952375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416841.089096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416841.218490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416841.346283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416841.469979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416841.626715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416841.732209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416841.866951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416841.995699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416842.148386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416842.275823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416842.406388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416842.527182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416842.674530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416842.786066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416842.937923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416843.056820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416843.193721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416843.323786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416843.464141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416843.587604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416843.710757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416843.850084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416843.968047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416844.094743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416844.215493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416844.343240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416844.475423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416844.606059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416844.764926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416844.893362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416845.021188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416845.149570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416845.278767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416845.401830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416845.524519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416845.648088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416845.779177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416845.906256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416846.028154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416846.151118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416846.283104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416846.409131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416846.537289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416846.660514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416846.795566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416846.940351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416847.076407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416847.202026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416847.336276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416847.474332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416847.588846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416847.712751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416847.857004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416847.965644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416848.098918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416848.229845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416848.370230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416848.495898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416848.630162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416848.766438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416848.902045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416849.041475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416849.168473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416849.302376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416849.426806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416849.564082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416849.702302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416849.826521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416849.962312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416850.084099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416850.211233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416850.336597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416850.466081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416850.588856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416850.751127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416850.949989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416851.261193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416851.630411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416852.005133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416852.570834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416852.988083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416853.201912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416853.425652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416853.607706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416853.880851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416854.039111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416854.230985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416854.389975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416854.582627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416854.768096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416854.916422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416855.125533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416855.276377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416855.479239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416855.594323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416855.774902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416855.969580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416856.103489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416856.277308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416856.467615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416856.666834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416856.795196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416856.966061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416857.114067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416857.291611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416857.480580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416857.652701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416857.811915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416858.019326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416858.163071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416858.345082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416858.524812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416858.780253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416858.956969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416859.153414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416859.273202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416859.438983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416859.590683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416859.787527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416859.921473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416860.095641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416860.232460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416860.421831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416860.791176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416861.016598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416861.150994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416861.277765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416861.409976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416861.550377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416861.689354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416861.845043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416862.066976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416862.251751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416862.402486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416862.563851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416862.722241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416862.900481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416863.069328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416863.253314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416863.415457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416863.586943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416863.760131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416863.955759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416864.140005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416864.290908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416864.474362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416864.678273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416864.817136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416865.000881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416865.170249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416865.312581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416865.495565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416865.689791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416865.869751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416866.043888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416866.208482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416866.514925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416866.786273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416867.046748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416867.177901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416867.326061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416867.441659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416867.584452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416867.711313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416867.854279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416867.980031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416868.133224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416868.256705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416868.395852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416868.520104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416868.647117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416868.773585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416868.915815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416869.025252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416869.153792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416869.281971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416869.474673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416869.660249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416869.783410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416869.912568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416870.041638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416870.167486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416870.303843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416870.443460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416870.567041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416870.701160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416870.835530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416870.967601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416871.086822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416871.214506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416871.339858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416871.469074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416871.598244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416871.727970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416871.854556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416871.982733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416872.121161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416872.246947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416872.386665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416872.520116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416872.642744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416872.786377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416872.902647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416873.027547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416873.160981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416873.308652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416873.446010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416873.574801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416873.724740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416873.848701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416873.986222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416874.087178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416874.223562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416874.342595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416874.472822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416874.606565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416874.752747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416874.898823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416875.017020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416875.145553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416875.293821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416875.421292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416875.550909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416875.661992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416875.795928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416875.946185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416876.085847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416876.213826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416876.334396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416876.462683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416876.585082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416876.713809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416876.840552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416876.964518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416877.097111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416877.219473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416877.350864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416877.472001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416877.608318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416877.733109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416877.880271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416878.005941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416878.138180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416878.269106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416878.396294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416878.530085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416878.651716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416878.774141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416878.903378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416879.025933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416879.157928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416879.275874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416879.402907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416879.543117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416879.693281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416879.814663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416879.967546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416880.085959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416880.217024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416880.340965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416880.470508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416880.592362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416880.726862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416880.864097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416881.003633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416881.113497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416881.248911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416881.392596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416881.521187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416881.644024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416881.776133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416881.899654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416882.030150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416882.152765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416882.312297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416882.415252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416882.541690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416882.689917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416882.819058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416882.960242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416883.082920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416883.220682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416883.339414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416883.463163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416883.598472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416883.718713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416883.851578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416883.971489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416884.130329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416884.254245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416884.376614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416884.506307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416884.639812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416884.766230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416884.898733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416885.019872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416885.150167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416885.269930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416885.404498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416885.532302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416885.672357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416885.792143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416885.925784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416886.056199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416886.193293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416886.356857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416886.628421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416886.739966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416886.883008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416887.005527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416887.152064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416887.275864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416887.402961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416887.524680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416887.649313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416887.777031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416887.908770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416888.030558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416888.161788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416888.286906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416888.424677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416888.550344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416888.676556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416888.806567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416888.943161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416889.068728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416889.213963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416889.334437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416889.480448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416889.586057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416889.727101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416889.871086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416889.980542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416890.133215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416890.258695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416890.394789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416890.522004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416890.643366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416890.801080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416890.905449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416891.032163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416891.163926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416891.308478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416891.419225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416891.564246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416891.675456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416891.817321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416891.981821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416892.096937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416892.227066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416892.358207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416892.515748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416892.651553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416892.771406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416892.903567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416893.032986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416893.161612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416893.284390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416893.395333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416893.542771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416893.665545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416893.785805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416893.924550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416894.067470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416894.190242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416894.328702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416894.478506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416894.587667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416894.703624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416894.844706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416894.963877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416895.084708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416895.213928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416895.342487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416895.481816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416895.586826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416895.712561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416895.841112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416895.973990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416896.106833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416896.238409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416896.371857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416896.505652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416896.643821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416896.783711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416896.896054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416897.013807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416897.135687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416897.274611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416897.395447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416897.531309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416897.650157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416897.786147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416897.909077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416898.041631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416898.169447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416898.329468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416898.446039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416898.583205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416898.704077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416898.844089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416898.967327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416899.101619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416899.227858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416899.360446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416899.500788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416899.645933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416899.768700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416899.900615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416900.044167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416900.167039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416900.288927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416900.436063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416900.569677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416900.706163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416900.836522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416900.978825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416901.092692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416901.223375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416901.355810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416901.484398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416901.622933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416901.764903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416901.892689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416902.023362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416902.164835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416902.279205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416902.406986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416902.539664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416902.669142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416902.796999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416902.952949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416903.076436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416903.206101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416903.340245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416903.459952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416903.587966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416903.714463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416903.848383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416903.978925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416904.105422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416904.245762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416904.376931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416904.518090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416904.652962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416904.777906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416904.913647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416905.038568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416905.185527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416905.310525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416905.461951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416905.586813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416905.733301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416905.851275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416905.970752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416906.103227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416906.236076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416906.363130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416906.506444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416906.647039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416906.797638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416906.918958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416907.069903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416907.192006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416907.341201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416907.458080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416907.579144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416907.729513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416907.861516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416907.973676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416908.089821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416908.230051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416908.362425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416908.480753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416908.633994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416908.760691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416908.903356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416909.023958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416909.167288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416909.282771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416909.421014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416909.567493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416909.665175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416909.794879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416909.923433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416910.056421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416910.206167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416910.330635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416910.464912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416910.587532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416910.713959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416910.840621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416910.986933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416911.107701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416911.237002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416911.370080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416911.541161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416911.778767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416911.940342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416912.088948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416912.213159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416912.344070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416912.468655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416912.598790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416912.727538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416912.856721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416912.998581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416913.146038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416913.275980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416913.403861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416913.529710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416913.660010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416913.797027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416913.937603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416914.076223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416914.210629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416914.335016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416914.463696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416914.593636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416914.730156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416914.855395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416914.986456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416915.115806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416915.244061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416915.376088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416915.520054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416915.637891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416915.769877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416915.894346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416916.023366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416916.151044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416916.291177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416916.404501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416916.541006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416916.679626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416916.816178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416916.952300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416917.074627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416917.203096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416917.338757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416917.461659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416917.593993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416917.729861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416917.853575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416917.981508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416918.128805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416918.257663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416918.387726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416918.519064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416918.649879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416918.773372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416918.902576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416919.024352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416919.155867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416919.282775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416919.426229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416919.555198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416919.684089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416919.817628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416919.961061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416920.086722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416920.226996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416920.345954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416920.483616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416920.603157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416920.742698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416920.900075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416921.016152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416921.145348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416921.293495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416921.405664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416921.538445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416921.667427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416921.790154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416921.966328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416922.088328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416922.225792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416922.341348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416922.473728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416922.602991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416922.725902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416922.855394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416922.994179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416923.131027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416923.264849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416923.402962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416923.519201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416923.649725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416923.783486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416923.920818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416924.059769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416924.200218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416924.329697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416924.461218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416924.590819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416924.720336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416924.846689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416924.974926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416925.111001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416925.249554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416925.386373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416925.529726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416925.645633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416925.777728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416925.899563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416926.026849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416926.164247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416926.294571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416926.437372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416926.571616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416926.703806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416926.841710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416926.962822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416927.094638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416927.218717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416927.347027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416927.481416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416927.618589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416927.751592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416927.892524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416928.025715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416928.154479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416928.293914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416928.410874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416928.540403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416928.667326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416928.806509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416928.940146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416929.072132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416929.210654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416929.334274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416929.461418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416929.586467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416929.720548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416929.844032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416929.989013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416930.113106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416930.259727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416930.387159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416930.520377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416930.648763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416930.799232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416930.914140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416931.044305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416931.183823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416931.303437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416931.443667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416931.595467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416931.705457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416931.833492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416931.960781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416932.090216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416932.212239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416932.343704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416932.469990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416932.600707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416932.730715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416932.861804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416932.992208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416933.128776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416933.264503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416933.407669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416933.528275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416933.664410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416933.790761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416933.935245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416934.067148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416934.207574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416934.347910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416934.459869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416934.575541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416934.713331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416934.833256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416934.980360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416935.098227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416935.224978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416935.356531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416935.486626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416935.625926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416935.756291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416935.894250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416936.034890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416936.159389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416936.289017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416936.437337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416936.567754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416936.696079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416936.828421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416936.959241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416937.090959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416937.215026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416937.346609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416937.473580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416937.602665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416937.735422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416937.894036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416938.014539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416938.137470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416938.264545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416938.399409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416938.526223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416938.652506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416938.775911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416938.912743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416939.032887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416939.166260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416939.294961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416939.457785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416939.585424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416939.728175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416939.835717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416939.979266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416940.093913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416940.225865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416940.355045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416940.500898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416940.627190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416940.786554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416940.892452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416941.030141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416941.143529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416941.273013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416941.407001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416941.531068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416941.666274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416941.807570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416941.938410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416942.071635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416942.207766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416942.337554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416942.460382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416942.582801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416942.710210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416942.853553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416942.960439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416943.088077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416943.212816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416943.343056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416943.464723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416943.604742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416943.728447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416943.858852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416943.997976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416944.139139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416944.276335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416944.402420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416944.522543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416944.652346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416944.781265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416944.904806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416945.030954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416945.160253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416945.302106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416945.443617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416945.573627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416945.726990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416945.831784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416945.963219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416946.086040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416946.212194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416946.341151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416946.483980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416946.600113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416946.722877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416946.851272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416946.995152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416947.124922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416947.251032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416947.384368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416947.525243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416947.650004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416947.776441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416947.900389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416948.027920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416948.156240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416948.288623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416948.425643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416948.558617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416948.692309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416948.817574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416948.950381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416949.092122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416949.209860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416949.340878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416949.471220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416949.588748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416949.721345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416949.854629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416949.982892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416950.116701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416950.254202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416950.379741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416950.510900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416950.648980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416950.767342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416950.892487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416951.020654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416951.147334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416951.273954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416951.403493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416951.527880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416951.672464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416951.872334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416952.022394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416952.164716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416952.283947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416952.418584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416952.542866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416952.684859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416952.827173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416952.968002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416953.084839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416953.201478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416953.335345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416953.460262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416953.591987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416953.714773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416953.854492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416953.978071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416954.128486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416954.262031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416954.395833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416954.516025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416954.642084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416954.762503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416954.897669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416955.027484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416955.152874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416955.279601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416955.420137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416955.541421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416955.667132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416955.811521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416955.963020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416956.085353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416956.230310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416956.339035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416956.484775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416956.606618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416956.749333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416956.863825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416956.998708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416957.123891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416957.261456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416957.385233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416957.516068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416957.642070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416957.767988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416957.898935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416958.024706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416958.150562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416958.274361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416958.401609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416958.546857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416958.664781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416958.787690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416958.927470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416959.058471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416959.191983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416959.337001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416959.461649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416959.585530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416959.711958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416959.834160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416959.963813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416960.103828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416960.235496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416960.372406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416960.511533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416960.638293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416960.765206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416960.899120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416961.024641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416961.154109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416961.271543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416961.406552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416961.533260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416961.684819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416961.790473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416961.932033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416962.061486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416962.190689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416962.342077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416962.481111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416962.597030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416962.735314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416962.868015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416963.003257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416963.139488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416963.271124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416963.391544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416963.524302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416963.659883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416963.786651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416963.902708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416964.042885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416964.153358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416964.288376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416964.444284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416964.585010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416964.717311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416964.838669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416964.960510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416965.091498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416965.227277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416965.342501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416965.467148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416965.597559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416965.735533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416965.874954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416965.999195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416966.138931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416966.270953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416966.400289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416966.520002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416966.656908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416966.777368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416966.933137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416967.060077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416967.192826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416967.326705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416967.457886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416967.582723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416967.708573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416967.831974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416967.966050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416968.094047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416968.244827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416968.361891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416968.491509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416968.624406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416968.759618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416968.892833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416969.018937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416969.149127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416969.275332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416969.401671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416969.525758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416969.647772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416969.777572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416969.905436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416970.039385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416970.165826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416970.306672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416970.422740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416970.579303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416970.695983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416970.827267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416970.955557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416971.080946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416971.210504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416971.333540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416971.461715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416971.601876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416971.716335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416971.851624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416971.980147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416972.115931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416972.246890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416972.383136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416972.525968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416972.652271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416972.786450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416972.927991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416973.071263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416973.189528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416973.321240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416973.469213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416973.585428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416973.708493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416973.836912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416973.962846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416974.086343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416974.229906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416974.343523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416974.481791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416974.603800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416974.728666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416974.869511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416975.000993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416975.138088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416975.267114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416975.396754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416975.542335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416975.648832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416975.771515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416975.897111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416976.026942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416976.150395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416976.279886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416976.403880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416976.541290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416976.677923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416976.808605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416976.954815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416977.086654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416977.211134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416977.329147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416977.452399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416977.585146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416977.702327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416977.834432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416977.953928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416978.083041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416978.209499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416978.335898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416978.460649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416978.591851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416978.714809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416978.845493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416978.974917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416979.103383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416979.236552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416979.379595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416979.508210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416979.640476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416979.762565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416979.898759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416980.045009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416980.162931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416980.291563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416980.437928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416980.557295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416980.709917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416980.821568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416980.964248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416981.094795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416981.221950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416981.352072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416981.486069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416981.618540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416981.758458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416981.894401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416982.059464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416982.168298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416982.313534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416982.439317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416982.570206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416982.704077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416982.824708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416982.963193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416983.091274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416983.225277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416983.359102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416983.489486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416983.633631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416983.761752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416983.893797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416984.024278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416984.186676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416984.303675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416984.417370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416984.560892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416984.685818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416984.819272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416984.949270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416985.082750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416985.197713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416985.318942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416985.454757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416985.580388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416985.724242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416985.831633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416985.977644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416986.087324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416986.217115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416986.341682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416986.477542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416986.603264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416986.738323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416986.876946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416987.038747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416987.212135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416987.342018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416987.469251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416987.598293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416987.728048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416987.877614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416988.017267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416988.147424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416988.276060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416988.406900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416988.530602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416988.663443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416988.781892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416988.922091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416989.051219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416989.199965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416989.325294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416989.456841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416989.578054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416989.710665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416989.849352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416989.968824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416990.101226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416990.235023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416990.373230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416990.512706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416990.632506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416990.764199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416990.891378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416991.024149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416991.147818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416991.275926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416991.416212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416991.531682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416991.657126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416991.793182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416991.922338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416992.044555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416992.189308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416992.323578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416992.453872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416992.576786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416992.721483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416992.833771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416992.960104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416993.087545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416993.227344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416993.351643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416993.471857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416993.604621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416993.729153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416993.881352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416994.003081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416994.140098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416994.265994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416994.396473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416994.523833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416994.649691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416994.787535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416994.892762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416995.013681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416995.153981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416995.272486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416995.391471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416995.520101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416995.666414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416995.774283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416995.907281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416996.059233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416996.188849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416996.327179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416996.472617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416996.595445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416996.706707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416996.834954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416996.967491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416997.089804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416997.242971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416997.358696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638416997.506746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416997.622910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416997.756984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416997.885568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416998.029816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416998.143934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416998.266980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416998.397768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416998.541818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416998.650155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416998.773321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416998.899678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416999.026296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416999.153960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416999.295591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416999.416879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416999.549855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416999.693411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416999.836084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638416999.954194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417000.085369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417000.212849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417000.344669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417000.480735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417000.599596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417000.730393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417000.897158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417001.030460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417001.152950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417001.278865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417001.405102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417001.526704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417001.656075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417001.787986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417001.914302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417002.051581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417002.203105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417002.330506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417002.452243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417002.576672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417002.717176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417002.833688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417002.957076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417003.095786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417003.214411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417003.343453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417003.469791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417003.602900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417003.750005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417003.882339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417004.010027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417004.137119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417004.275650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417004.403078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417004.524867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417004.665546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417004.774786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417004.900811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417005.032333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417005.153981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417005.283014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417005.412795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417005.546031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417005.682034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417005.832090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417005.957675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417006.086921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417006.215432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417006.341020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417006.477283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417006.600962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417006.729223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417006.850299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417006.996264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417007.115203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417007.263999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417007.391747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417007.517577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417007.645509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417007.768886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417007.907091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417008.041298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417008.178375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417008.311946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417008.461545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417008.584071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417008.707290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417008.836872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417008.965371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417009.090460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417009.233203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417009.349944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417009.497604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417009.606174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417009.741916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417009.889374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417010.014400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417010.144545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417010.275680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417010.394831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417010.526717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417010.652074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417010.794389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417010.919378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417011.057508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417011.195282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417011.328547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417011.448300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417011.577818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417011.709200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417011.836602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417011.979211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417012.118176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417012.249363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417012.386905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417012.505823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417012.640048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417012.773221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417012.898526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417013.040262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417013.165688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417013.293723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417013.422583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417013.556662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417013.685354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417013.830435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417013.956874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417014.081050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417014.215858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417014.340730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417014.476290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417014.604220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417014.751168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417014.864291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417014.998342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417015.128968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417015.266051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417015.386459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417015.514300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417015.648073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417015.775833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417015.915220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417016.041374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417016.178150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417016.333605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417016.458420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417016.587369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417016.709635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417016.834008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417016.960776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417017.102723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417017.216585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417017.365017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417017.477944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417017.620570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417017.743821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417017.881535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417018.004040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417018.133099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417018.265206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417018.398623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417018.521680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417018.660517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417018.794528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417018.937195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417019.073193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417019.204788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417019.330126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417019.458655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417019.584677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417019.713365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417019.834708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417019.953482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417020.083501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417020.210902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417020.335060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417020.474457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417020.616101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417020.756420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417020.873358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417021.002791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417021.139441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417021.274651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417021.411203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417021.535033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417021.667033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417021.790297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417021.932733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417022.090286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417022.195750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417022.333636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417022.474928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417022.605152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417022.714189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417022.850611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417022.985609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417023.124685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417023.252890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417023.387696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417023.515765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417023.662168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417023.763498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417023.899584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417024.025540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417024.159444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417024.287031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417024.413986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417024.541333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417024.670942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417024.833060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417024.949554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417025.072651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417025.205427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417025.330465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417025.459126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417025.589011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417025.720230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417025.860181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417025.989613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417026.125210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417026.256762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417026.385752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417026.522485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417026.643142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417026.779227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417026.899630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417027.027455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417027.166749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417027.298237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417027.418629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417027.540362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417027.661952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417027.788512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417027.920835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417028.057467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417028.175941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417028.340274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417028.448294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417028.576699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417028.703409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417028.840737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417028.959081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417029.084235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417029.213729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417029.356772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417029.477792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417029.608670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417029.733305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417029.877181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417030.009734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417030.136456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417030.273875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417030.394824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417030.521760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417030.641869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417030.773820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417030.918433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417031.031230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417031.157943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417031.291668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417031.461642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417031.712205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417031.981565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417032.271544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417032.625079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417032.888813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417033.154994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417033.422839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417033.727966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417034.113643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417034.241068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417034.451705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417034.645036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417034.865065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417035.124428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417035.263675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417035.413733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417035.624737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417035.787022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417035.973355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417036.122898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417036.284989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417036.458658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417036.677701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417036.834131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417036.995952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417037.154382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417037.356822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417037.502141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417037.650717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417037.825072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417038.011537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417038.170565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417038.387574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417038.521594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417038.691936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417038.854347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417039.026873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417039.213916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417039.358741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417039.541924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417039.811581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417040.037711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417040.206517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417040.377462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417040.518214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417040.660000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417040.855532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417040.975379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417041.132988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417041.274230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417041.510565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417041.819134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417042.078344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417042.211222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417042.348921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417042.484827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417042.624782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417042.775468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417042.970066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417043.108848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417043.311170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417043.504342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417043.654235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417043.825937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417043.974643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417044.152958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417044.340182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417044.526317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417044.711978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417044.876475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417045.035616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417045.224701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417045.394996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417045.533958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417045.711434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417045.923753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417046.087251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417046.219023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417046.399950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417046.568762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417046.780747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417046.913084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417047.086289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417047.251214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417047.457909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417047.725662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417048.003926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417048.289606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417048.464829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417048.591744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417048.726031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417048.853124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417048.978969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417049.123679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417049.253772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417049.414687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417049.521574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417049.661588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417049.773104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417049.904676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417050.030707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417050.167746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417050.308803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417050.457194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417050.697332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417050.823920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417050.956216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417051.076599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417051.202805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417051.333247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417051.463359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417051.584974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417051.711929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417051.841752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417051.982326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417052.106086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417052.251026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417052.380198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417052.514505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417052.633159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417052.759706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417052.893868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417053.020646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417053.150604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417053.284824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417053.419056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417053.550994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417053.675431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417053.813531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417053.947136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417054.082886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417054.204091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417054.337607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417054.477531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417054.602356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417054.722610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417054.855674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417054.990293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417055.141921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417055.271485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417055.395664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417055.516144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417055.648674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417055.783159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417055.921978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417056.080364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417056.206750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417056.334699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417056.480312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417056.587951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417056.722433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417056.843316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417056.975551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417057.115277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417057.248546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417057.380232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417057.513702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417057.635153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417057.760219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417057.888994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417058.037063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417058.146828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417058.284901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417058.409949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417058.553685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417058.681274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417058.844129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417058.956770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417059.084855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417059.216837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417059.349358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417059.472474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417059.607978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417059.723248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417059.885457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417059.990194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417060.138587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417060.253978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417060.388594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417060.523807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417060.641089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417060.770526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417060.897675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417061.024976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417061.177885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417061.283864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417061.433264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417061.557731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417061.685937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417061.831183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417061.961671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417062.083125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417062.222668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417062.342668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417062.476122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417062.600124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417062.729051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417062.863193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417062.998307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417063.135075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417063.267666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417063.385834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417063.521891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417063.643902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417063.773471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417063.893152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417064.023973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417064.150779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417064.278820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417064.410796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417064.541831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417064.665773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417064.802733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417064.941518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417065.118067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417065.250519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417065.392407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417065.516041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417065.649777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417065.775454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417065.910113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417066.033702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417066.169806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417066.299891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417066.437852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417066.564101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417066.712164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417066.822389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417066.974975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417067.076915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417067.216697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417067.335094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417067.484073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417067.611594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417067.755578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417067.893037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417068.038543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417068.165000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417068.269748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417068.397002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417068.526836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417068.653219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417068.782844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417068.925598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417069.060993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417069.192072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417069.337439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417069.454484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417069.587953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417069.709666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417069.850847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417069.973786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417070.112402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417070.234427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417070.379060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417070.508501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417070.635279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417070.763396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417070.902129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417071.022635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417071.160110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417071.287326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417071.456153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417071.579839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417071.706136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417071.827258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417071.961603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417072.104358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417072.230319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417072.367191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417072.500283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417072.626015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417072.752429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417072.879237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417073.006946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417073.137266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417073.265526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417073.386289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417073.537082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417073.642703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417073.762256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417073.897753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417074.040299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417074.155821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417074.286216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417074.415875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417074.570551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417074.687525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417074.824122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417074.960087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417075.082710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417075.210481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417075.334955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417075.457931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417075.597891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417075.720857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417075.849431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417075.973877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417076.112336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417076.236168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417076.379187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417076.515809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417076.637763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417076.763687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417076.891202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417077.034646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417077.148936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417077.287161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417077.409031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417077.537278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417077.692170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417077.809028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417077.937519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417078.079716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417078.211309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417078.329277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417078.460206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417078.582072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417078.728307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417078.847010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417078.983152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417079.093816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417079.224338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417079.362216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417079.502976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417079.628880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417079.768029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417079.896713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417080.036614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417080.145776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417080.275131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417080.403687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417080.537982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417080.682291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417080.810863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417080.937155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417081.075118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417081.194782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417081.330411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417081.455311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417081.585372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417081.710448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417081.836317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417081.959587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417082.099061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417082.222028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417082.365751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417082.495270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417082.638695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417082.758495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417082.886510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417083.010459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417083.137163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417083.263361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417083.386328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417083.512346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417083.645913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417083.764961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417083.908676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417084.029941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417084.155504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417084.283305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417084.410088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417084.539404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417084.673104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417084.804730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417084.931857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417085.064188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417085.200346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417085.348574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417085.467903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417085.598114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417085.725212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417085.859343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417085.993870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417086.131119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417086.266280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417086.390295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417086.520877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417086.646115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417086.773967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417086.898546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417087.029518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417087.153718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417087.293892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417087.404136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417087.534570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417087.663486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417087.806227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417087.946398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417088.078879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417088.201795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417088.349239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417088.457595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417088.586250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417088.716248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417088.856377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417088.988143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417089.127477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417089.267467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417089.396518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417089.520835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417089.646051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417089.791245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417089.911481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417090.043556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417090.176362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417090.306766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417090.444684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417090.572601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417090.703508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417090.825533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417090.963005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417091.078222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417091.217314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417091.332014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417091.456596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417091.598546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417091.730445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417091.872471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417091.998625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417092.123558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417092.306293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417092.528430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417092.668678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417092.818843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417092.947495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417093.090057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417093.206623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417093.333317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417093.481610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417093.610955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417093.743460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417093.870751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417094.011180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417094.147669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417094.268447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417094.391577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417094.535600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417094.652325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417094.777803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417094.915496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417095.058048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417095.198295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417095.327367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417095.455864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417095.580488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417095.704113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417095.831217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417095.962366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417096.085463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417096.223397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417096.354091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417096.474755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417096.607455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417096.731867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417096.872879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417097.002776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417097.137245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417097.266296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417097.389642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417097.517680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417097.650919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417097.776434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417097.912641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417098.040496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417098.183711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417098.312599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417098.451516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417098.586375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417098.708441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417098.840978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417098.963970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417099.096904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417099.243319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417099.376170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417099.503374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417099.636729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417099.757994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417099.886304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417100.025006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417100.166074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417100.291101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417100.438156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417100.559901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417100.697001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417100.834149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417100.962548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417101.106987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417101.236699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417101.373960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417101.510964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417101.636432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417101.763665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417101.899559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417102.061197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417102.185874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417102.327373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417102.454750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417102.576314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417102.715824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417102.829123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417102.957892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417103.098347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417103.215802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417103.347796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417103.474959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417103.632208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417103.753858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417103.891975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417104.022773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417104.167714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417104.282618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417104.427731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417104.561168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417104.693372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417104.821850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417104.958952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417105.084863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417105.224729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417105.347951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417105.486742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417105.622875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417105.766929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417105.873587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417106.014864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417106.140440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417106.272823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417106.395908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417106.540921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417106.661216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417106.785789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417106.913710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417107.068900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417107.193742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417107.326770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417107.453869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417107.579224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417107.722461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417107.830851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417107.990288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417108.104088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417108.231899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417108.364040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417108.494580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417108.637662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417108.765597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417108.902703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417109.017059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417109.162585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417109.278419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417109.400592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417109.535156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417109.677081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417109.808482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417109.942611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417110.076847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417110.205474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417110.330933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417110.463468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417110.591010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417110.728141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417110.848281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417110.978547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417111.132057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417111.268311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417111.380694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417111.521416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417111.646375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417111.770352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417111.897644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417112.039673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417112.166656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417112.309136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417112.435248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417112.574878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417112.705249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417112.836125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417112.963937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417113.108187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417113.229193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417113.379241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417113.510980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417113.638852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417113.759548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417113.894164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417114.027117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417114.149004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417114.275550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417114.410626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417114.534085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417114.660575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417114.785730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417114.933158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417115.080106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417115.207245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417115.323818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417115.460907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417115.579284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417115.712378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417115.842579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417116.005455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417116.133073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417116.272516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417116.390531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417116.515016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417116.638603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417116.778891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417116.892794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417117.026233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417117.159869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417117.308562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417117.410096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417117.538613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417117.684261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417117.842246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417117.972662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417118.084490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417118.218434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417118.352118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417118.494342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417118.642067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417118.766880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417118.895671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417119.016681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417119.142632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417119.264352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417119.397329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417119.523731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417119.670044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417119.814625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417119.927190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417120.068766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417120.212035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417120.337476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417120.472910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417120.605732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417120.745568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417120.874017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417121.012230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417121.141326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417121.274756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417121.394793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417121.526134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417121.654027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417121.790204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417121.931264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417122.066063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417122.190576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417122.327794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417122.451893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417122.586232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417122.704856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417122.830302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417122.959761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417123.088356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417123.214560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417123.348673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417123.463889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417123.604956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417123.732997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417123.878611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417124.003317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417124.139387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417124.266297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417124.386963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417124.516685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417124.644888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417124.765205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417124.909979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417125.015209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417125.136065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417125.273698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417125.425164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417125.543366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417125.676365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417125.802900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417125.954655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417126.085314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417126.221723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417126.347891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417126.491948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417126.623532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417126.756675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417126.878225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417127.005124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417127.134649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417127.269723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417127.397640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417127.511730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417127.644716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417127.772822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417127.897169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417128.027576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417128.152530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417128.284875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417128.412989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417128.545690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417128.677914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417128.807401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417128.942900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417129.083320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417129.204414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417129.337538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417129.469342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417129.622460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417129.737440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417129.879215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417130.003580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417130.139164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417130.258165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417130.391145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417130.516507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417130.648113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417130.773889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417130.902139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417131.024882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417131.160567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417131.285273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417131.430853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417131.550447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417131.700557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417131.817362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417131.956174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417132.178609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417132.308322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417132.445263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417132.583391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417132.710149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417132.842003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417132.970175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417133.103040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417133.256568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417133.382969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417133.517222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417133.642396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417133.767728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417133.895304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417134.023639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417134.149539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417134.284352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417134.418526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417134.566136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417134.687052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417134.820945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417134.950374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417135.095432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417135.226216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417135.349007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417135.490661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417135.628587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417135.761127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417135.891252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417136.018890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417136.154299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417136.267334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417136.407074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417136.541128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417136.677358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417136.817513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417136.935421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417137.079906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417137.210926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417137.338312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417137.463959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417137.598146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417137.743332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417137.861997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417138.005360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417138.135807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417138.277175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417138.383257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417138.516277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417138.642834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417138.770123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417138.897216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417139.028341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417139.159574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417139.297700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417139.422036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417139.555430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417139.689988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417139.829539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417139.954072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417140.082242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417140.220068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417140.333126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417140.461448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417140.596302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417140.731509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417140.873860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417140.999731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417141.134011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417141.253186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417141.386816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417141.516246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417141.646993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417141.778772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417141.923090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417142.028410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417142.166970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417142.299891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417142.442984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417142.579005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417142.713664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417142.853884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417142.965047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417143.097363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417143.242389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417143.369934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417143.509728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417143.625803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417143.752122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417143.881016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417144.009346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417144.139694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417144.270702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417144.395719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417144.533247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417144.658451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417144.829430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417144.946919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417145.095401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417145.206082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417145.337301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417145.465636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417145.593432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417145.725001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417145.878405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417145.993951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417146.125256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417146.251823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417146.385631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417146.507658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417146.631190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417146.771749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417146.903732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417147.042165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417147.176173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417147.308387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417147.456838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417147.574249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417147.701912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417147.833970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417147.966484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417148.086280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417148.224180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417148.354791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417148.500830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417148.628841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417148.773582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417148.893898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417149.024571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417149.140866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417149.265068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417149.399913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417149.532793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417149.649899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417149.778676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417149.898908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417150.039364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417150.163416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417150.294306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417150.430604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417150.574698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417150.695654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417150.827188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417150.950625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417151.099473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417151.204636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417151.331311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417151.463301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417151.597314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417151.738277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417151.879285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417152.005103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417152.135088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417152.257106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417152.394745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417152.517246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417152.641856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417152.770105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417152.899013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417153.025844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417153.161091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417153.291688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417153.434207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417153.571004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417153.701758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417153.827120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417153.957241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417154.085191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417154.224995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417154.347116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417154.489619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417154.605576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417154.757843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417154.877983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417155.006791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417155.129116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417155.269903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417155.407637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417155.539131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417155.663898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417155.815170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417155.938672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417156.066332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417156.194054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417156.343884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417156.468916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417156.598883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417156.708535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417156.839552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417156.974194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417157.098272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417157.227988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417157.378641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417157.499773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417157.623105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417157.765669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417157.896994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417158.030251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417158.143208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417158.272914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417158.408024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417158.536917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417158.676028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417158.807147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417158.949483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417159.080792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417159.209888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417159.330964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417159.458429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417159.585034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417159.718050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417159.849447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417159.997590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417160.123493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417160.274893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417160.390190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417160.520859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417160.640664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417160.780156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417160.897514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417161.035441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417161.166131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417161.298391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417161.441679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417161.591994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417161.710538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417161.838408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417161.993287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417162.146910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417162.263356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417162.393669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417162.519664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417162.653457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417162.783651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417162.902414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417163.026968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417163.174496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417163.291233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417163.425025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417163.552233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417163.688078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417163.811741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417163.965892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417164.094273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417164.238823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417164.355630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417164.502580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417164.633296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417164.749063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417164.888254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417165.019752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417165.142476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417165.271514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417165.394211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417165.521565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417165.643945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417165.773854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417165.897673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417166.023857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417166.150854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417166.285898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417166.434503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417166.559703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417166.686408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417166.809452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417166.947804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417167.076777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417167.201886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417167.335873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417167.463716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417167.620947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417167.725672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417167.906224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417168.087736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417168.227528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417168.365738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417168.505430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417168.636251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417168.767737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417168.886979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417169.016963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417169.140387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417169.281829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417169.407838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417169.557590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417169.681930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417169.807344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417169.939647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417170.084448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417170.209313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417170.343200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417170.468503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417170.598756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417170.735708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417170.867548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417171.006247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417171.142893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417171.257904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417171.389575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417171.515776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417171.641551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417171.764445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417171.886024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417172.014751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417172.143875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417172.271980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417172.432798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417172.533406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417172.686827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417172.808658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417172.970621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417173.076460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417173.210005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417173.344748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417173.455990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417173.580680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417173.707417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417173.834201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417173.973637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417174.090285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417174.245583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417174.376858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417174.527934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417174.632861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417174.762299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417174.883843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417175.034691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417175.146297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417175.272629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417175.402189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417175.531900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417175.655237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417175.786304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417175.947965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417176.092726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417176.201958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417176.333097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417176.462453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417176.615785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417176.728724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417176.872287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417177.010217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417177.154419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417177.268771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417177.402517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417177.526056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417177.675291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417177.796058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417177.946254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417178.066890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417178.199731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417178.326834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417178.456236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417178.581984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417178.707618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417178.847956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417178.974551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417179.093886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417179.222687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417179.357023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417179.495874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417179.634168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417179.766561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417179.889816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417180.023856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417180.143676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417180.284425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417180.397085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417180.554060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417180.680798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417180.800567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417180.931111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417181.090233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417181.205660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417181.347789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417181.453137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417181.592890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417181.718650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417181.851719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417181.959377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417182.090130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417182.220342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417182.346783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417182.479807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417182.619652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417182.759732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417182.889443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417183.007735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417183.158635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417183.280191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417183.405729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417183.524783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417183.660574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417183.780384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417183.931335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417184.040008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417184.177194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417184.313077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417184.467116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417184.574372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417184.704511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417184.835198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417184.969972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417185.106067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417185.259913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417185.387054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417185.522093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417185.640336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417185.781263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417185.894920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417186.031096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417186.161701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417186.344091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417186.541042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417186.708503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417186.832680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417186.978957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417187.099221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417187.218135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417187.364596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417187.502059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417187.629646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417187.762245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417187.906373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417188.041490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417188.146612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417188.285408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417188.413836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417188.570086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417188.687399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417188.822231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417188.955589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417189.077540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417189.209583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417189.332664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417189.456298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417189.603039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417189.724357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417189.849934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417189.977968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417190.121715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417190.247420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417190.375848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417190.514390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417190.642633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417190.769508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417190.895489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417191.036598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417191.201977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417191.317249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417191.456779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417191.570762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417191.687983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417191.830369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417191.989556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417192.097590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417192.241039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417192.374650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417192.509331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417192.640433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417192.766858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417192.897524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417193.024578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417193.144267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417193.279221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417193.423196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417193.543991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417193.657276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417193.798354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417193.923897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417194.069102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417194.212369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417194.326021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417194.449862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417194.593167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417194.694855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417194.824600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417194.946305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417195.097845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417195.206457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417195.342269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417195.476118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417195.609147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417195.747786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417195.886158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417196.014164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417196.147795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417196.269972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417196.396548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417196.528960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417196.656953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417196.786415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417196.932326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417197.053667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417197.201669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417197.329063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417197.457186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417197.582269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417197.719944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417197.831262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417197.970582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417198.089632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417198.227628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417198.355715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417198.494772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417198.623774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417198.745233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417198.892125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417199.014928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417199.133918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417199.275463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417199.386431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417199.523559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417199.641623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417199.769623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417199.895813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417200.027407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417200.160133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417200.287050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417200.421700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417200.584902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417200.688048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417200.823142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417200.945159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417201.075036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417201.198973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417201.332180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417201.463389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417201.587613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417201.720891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417201.847011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417201.972096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417202.103735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417202.242319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417202.389740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417202.516587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417202.662290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417202.767877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417202.895101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417203.036433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417203.163361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417203.285211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417203.427935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417203.566259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417203.693061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417203.821262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417203.947610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417204.075386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417204.206543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417204.323921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417204.452488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417204.582350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417204.706650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417204.830592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417204.952300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417205.091314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417205.218078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417205.333431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417205.468919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417205.601428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417205.750329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417205.874365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417206.005452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417206.129864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417206.279729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417206.384214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417206.512878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417206.643369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417206.770001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417206.895695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417207.032185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417207.169253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417207.311093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417207.430427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417207.574994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417207.700861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417207.833294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417207.954517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417208.087814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417208.212124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417208.347679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417208.461345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417208.595080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417208.719158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417208.865319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417208.989676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417209.124915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417209.255044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417209.388854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417209.515475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417209.641577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417209.763156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417209.894886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417210.036446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417210.147209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417210.286177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417210.409582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417210.533683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417210.680981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417210.798456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417210.931842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417211.065840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417211.197203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417211.325586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417211.455233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417211.594997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417211.717480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417211.853074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417212.034618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417212.266565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417212.519547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417212.761098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417213.161340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417213.529818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417213.897652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417214.268821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417214.638475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417214.840769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417215.016090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417215.183816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417215.416990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417215.581300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417215.762201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417215.923401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417216.119931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417216.262992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417216.435983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417216.616415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417216.779034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417216.955715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417217.134417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417217.314248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417217.477525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417217.635440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417217.781341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417217.945790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417218.138461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417218.289364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417218.471076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417218.646581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417218.800086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417218.966982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417219.139882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417219.328242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417219.510175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417219.657026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417219.835058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417220.012806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417220.179751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417220.376523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417220.649345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417220.805267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417220.968405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417221.123067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417221.279275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417221.456826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417221.595728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417221.798931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417221.986114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417222.147928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417222.406981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417222.735656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417222.906141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417223.060820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417223.189529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417223.342864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417223.472661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417223.618798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417223.783957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417223.968025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417224.149732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417224.320048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417224.513826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417224.663782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417224.843007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417225.014192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417225.204716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417225.390124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417225.596437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417225.762169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417225.914678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417226.100342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417226.261350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417226.456318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417226.616867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417226.803564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417226.970952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417227.191033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417227.344198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417227.521326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417227.719741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417227.845361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417228.019139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417228.288204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417228.743422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417228.928461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417229.073438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417229.201877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417229.352987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417229.487611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417229.639812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417229.746636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417229.886499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417230.016917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417230.142901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417230.290542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417230.428892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417230.555773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417230.695232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417230.820238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417230.945449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417231.077179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417231.210187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417231.371895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417231.609542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417231.725468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417231.854666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417232.005829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417232.125099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417232.263527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417232.393481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417232.533203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417232.659886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417232.775178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417232.900478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417233.028318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417233.171804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417233.282370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417233.413475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417233.554525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417233.715659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417233.822735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417233.959834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417234.080315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417234.215778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417234.344732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417234.494218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417234.603050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417234.743018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417234.881964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417235.006480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417235.151216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417235.264018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417235.388873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417235.512996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417235.644893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417235.780292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417235.910801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417236.039996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417236.198844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417236.331959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417236.457362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417236.599409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417236.737973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417236.876844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417236.999665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417237.136848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417237.261499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417237.404415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417237.520355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417237.648850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417237.769706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417237.907263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417238.043632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417238.156773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417238.295292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417238.433332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417238.566114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417238.690863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417238.819186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417238.949067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417239.068266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417239.209769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417239.324662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417239.452228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417239.575275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417239.713568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417239.828416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417239.963248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417240.103340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417240.235377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417240.382860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417240.508313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417240.638696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417240.780176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417240.890668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417241.021509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417241.146370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417241.275129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417241.412978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417241.552262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417241.663543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417241.806892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417241.943076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417242.076173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417242.200066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417242.342102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417242.451142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417242.580478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417242.698659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417242.835351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417242.949702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417243.080652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417243.200168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417243.349442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417243.452445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417243.575099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417243.708519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417243.847979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417243.979859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417244.130810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417244.271266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417244.404005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417244.531556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417244.677219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417244.800699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417244.928782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417245.063349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417245.200536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417245.324930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417245.452124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417245.576518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417245.721027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417245.833143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417245.968516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417246.110978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417246.253587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417246.386096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417246.525447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417246.639334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417246.769291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417246.888583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417247.024635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417247.136753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417247.266704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417247.396655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417247.535142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417247.660389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417247.798587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417247.939146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417248.082404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417248.206851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417248.365791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417248.469819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417248.615266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417248.746413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417248.883490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417249.029337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417249.143268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417249.280703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417249.396471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417249.513360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417249.647131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417249.777735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417249.905600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417250.050275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417250.185750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417250.308344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417250.447094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417250.568778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417250.696686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417250.821610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417250.968885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417251.079129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417251.200407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417251.337107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417251.468070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417251.591666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417251.761925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417251.876177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417251.998045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417252.128926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417252.272849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417252.378715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417252.509802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417252.641089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417252.765487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417252.890927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417253.017820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417253.138799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417253.263781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417253.385948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417253.518125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417253.637941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417253.773413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417253.894277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417254.021198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417254.144306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417254.266778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417254.395727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417254.613447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417254.740007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417254.876648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417254.996923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417255.123310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417255.255939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417255.378162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417255.514391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417255.643598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417255.769174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417255.907851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417256.032616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417256.159239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417256.287951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417256.430318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417256.566319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417256.699070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417256.822911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417256.947120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417257.071098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417257.200177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417257.323616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417257.449340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417257.574728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417257.697173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417257.828216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417257.951941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417258.074254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417258.206816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417258.329210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417258.450094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417258.577907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417258.709154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417258.825835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417258.957491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417259.082541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417259.213183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417259.342941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417259.470822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417259.617591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417259.721777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417259.864594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417259.996153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417260.131478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417260.278637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417260.417296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417260.545617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417260.683375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417260.820392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417260.942833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417261.071920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417261.202189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417261.332379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417261.455689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417261.581628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417261.715179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417261.834842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417261.964454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417262.092296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417262.222067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417262.380310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417262.477656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417262.629193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417262.755825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417262.902057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417263.013072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417263.141870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417263.265741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417263.405946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417263.536646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417263.658506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417263.780833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417263.928157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417264.040319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417264.202427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417264.316146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417264.445065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417264.573833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417264.704357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417264.830935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417264.971532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417265.105737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417265.228026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417265.367743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417265.512717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417265.629854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417265.762501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417265.905447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417266.022424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417266.156471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417266.283298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417266.426453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417266.563660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417266.714523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417266.821081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417266.962041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417267.074538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417267.206774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417267.354118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417267.475369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417267.594961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417267.726815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417267.868900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417268.003114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417268.136376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417268.260378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417268.391212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417268.516240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417268.651915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417268.770675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417268.899045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417269.018549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417269.154579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417269.282582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417269.423875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417269.538074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417269.677872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417269.821765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417269.949736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417270.077459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417270.202614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417270.322510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417270.453331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417270.600189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417270.714561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417270.844923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417270.985474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417271.114307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417271.262012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417271.384743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417271.517438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417271.639019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417271.767244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417271.887031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417272.021655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417272.146388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417272.278655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417272.405511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417272.545548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417272.682868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417272.818435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417273.015369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417273.205342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417273.330168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417273.472786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417273.599921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417273.740254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417273.870075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417274.002556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417274.142253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417274.262895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417274.388114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417274.516956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417274.646608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417274.776725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417274.909817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417275.050397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417275.181511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417275.317533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417275.458251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417275.575623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417275.724191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417275.842242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417275.972517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417276.103302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417276.252646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417276.376241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417276.512123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417276.645753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417276.772502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417276.904047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417277.033174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417277.162316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417277.294422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417277.440280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417277.573413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417277.698236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417277.831468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417277.952961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417278.093174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417278.220368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417278.347408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417278.486480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417278.624926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417278.762965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417278.884453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417279.017359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417279.142859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417279.279624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417279.407681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417279.558238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417279.687599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417279.822711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417279.975853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417280.125176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417280.240491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417280.366160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417280.500169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417280.638605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417280.763855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417280.886486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417281.016097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417281.140763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417281.269869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417281.431759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417281.556237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417281.689208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417281.823232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417281.965194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417282.114361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417282.256599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417282.372181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417282.492885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417282.627825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417282.761144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417282.882229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417283.014206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417283.138283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417283.267392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417283.388745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417283.521775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417283.643164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417283.777421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417283.918925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417284.051018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417284.186411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417284.324797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417284.458735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417284.581301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417284.707611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417284.838372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417284.958204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417285.082037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417285.205889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417285.341297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417285.471275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417285.601523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417285.767016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417285.885680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417286.013222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417286.156658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417286.264450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417286.399206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417286.526405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417286.667149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417286.787984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417286.935770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417287.062819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417287.181253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417287.317549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417287.441932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417287.571660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417287.701510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417287.829490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417287.999777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417288.102598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417288.261612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417288.373051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417288.503380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417288.640425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417288.762066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417288.886160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417289.015605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417289.153711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417289.283209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417289.408873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417289.533063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417289.670800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417289.810054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417289.944530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417290.079313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417290.200424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417290.323725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417290.449703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417290.580263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417290.701095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417290.827002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417290.955103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417291.090590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417291.223948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417291.369420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417291.496866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417291.636160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417291.757543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417291.884712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417292.015199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417292.141748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417292.271886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417292.399608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417292.522315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417292.664396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417292.789911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417292.929233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417293.051776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417293.189974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417293.313355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417293.441216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417293.572748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417293.702255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417293.827508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417293.966348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417294.091771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417294.226064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417294.362542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417294.491363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417294.615048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417294.765746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417294.885813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417295.014266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417295.141362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417295.268549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417295.394155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417295.529606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417295.653901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417295.797298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417295.966140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417296.084491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417296.216581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417296.362981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417296.476783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417296.612535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417296.746254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417296.869759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417297.009686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417297.138870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417297.256608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417297.390947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417297.532922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417297.659633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417297.787470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417297.927073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417298.065089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417298.179209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417298.324689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417298.450883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417298.576923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417298.700568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417298.825165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417298.952586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417299.078167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417299.222811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417299.330525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417299.458038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417299.596444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417299.735750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417299.866691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417299.999163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417300.150816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417300.265975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417300.390336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417300.521143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417300.648326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417300.787051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417300.926407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417301.062121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417301.188881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417301.337935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417301.450958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417301.569061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417301.718150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417301.843689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417301.972506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417302.099560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417302.235257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417302.381916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417302.506163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417302.654140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417302.756883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417302.889084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417303.022489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417303.151098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417303.298890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417303.426555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417303.546356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417303.684127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417303.838897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417303.956887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417304.095616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417304.203469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417304.341329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417304.469675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417304.612657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417304.742484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417304.874688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417305.014713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417305.134768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417305.267088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417305.393019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417305.534263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417305.643058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417305.764945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417305.893537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417306.032435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417306.162410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417306.298961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417306.429150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417306.568250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417306.713244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417306.830001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417306.967825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417307.084068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417307.227993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417307.366556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417307.492880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417307.628789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417307.763483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417307.900647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417308.013966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417308.150733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417308.266817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417308.397817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417308.547268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417308.676280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417308.824344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417308.954257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417309.078583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417309.207616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417309.344004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417309.469363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417309.607714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417309.738251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417309.873924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417310.001888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417310.125098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417310.259263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417310.383751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417310.507647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417310.632065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417310.776689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417310.895801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417311.025784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417311.158233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417311.301422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417311.427331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417311.570792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417311.683819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417311.817736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417311.991027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417312.100171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417312.230130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417312.357686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417312.492879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417312.635358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417312.825273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417312.966796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417313.083784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417313.218365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417313.329456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417313.464576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417313.594114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417313.711474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417313.861886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417314.015009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417314.124116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417314.257878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417314.384200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417314.512022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417314.636941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417314.772069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417314.896040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417315.029455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417315.174215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417315.305203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417315.440383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417315.574526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417315.692944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417315.845443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417315.951740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417316.084696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417316.215067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417316.347041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417316.488282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417316.614012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417316.753045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417316.879084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417317.008291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417317.145913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417317.263275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417317.395824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417317.527641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417317.663683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417317.801777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417317.938667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417318.065621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417318.191423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417318.319185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417318.444818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417318.578170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417318.697879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417318.825467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417318.953134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417319.080463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417319.206626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417319.330243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417319.474010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417319.609258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417319.749734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417319.883967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417320.014066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417320.134202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417320.258791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417320.401491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417320.512414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417320.634878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417320.765619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417320.892471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417321.032085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417321.156396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417321.304066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417321.416041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417321.552710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417321.687905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417321.823342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417321.947655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417322.076365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417322.202755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417322.334752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417322.457313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417322.583608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417322.727184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417322.855936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417322.991791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417323.145598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417323.253433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417323.399988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417323.509203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417323.640570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417323.767454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417323.909453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417324.037870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417324.182852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417324.291994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417324.440784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417324.567674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417324.699699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417324.822445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417324.947343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417325.087329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417325.216923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417325.329729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417325.470402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417325.607102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417325.749013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417325.890476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417326.019027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417326.151321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417326.289089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417326.406808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417326.538412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417326.677547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417326.803258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417326.941403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417327.075738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417327.192423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417327.316431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417327.447068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417327.572862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417327.691570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417327.824486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417327.951954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417328.098447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417328.215310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417328.348530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417328.472074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417328.607378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417328.751279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417328.875101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417329.011420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417329.142514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417329.264519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417329.392539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417329.517543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417329.652368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417329.779343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417329.932004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417330.076285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417330.190180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417330.315082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417330.449967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417330.573361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417330.702013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417330.839407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417330.956785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417331.089977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417331.213675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417331.345338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417331.490137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417331.629454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417331.768361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417331.901314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417332.024768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417332.152340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417332.279958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417332.410239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417332.538309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417332.662692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417332.802912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417332.936172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417333.072408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417333.194309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417333.324189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417333.452277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417333.580595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417333.705801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417333.848584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417333.988495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417334.112084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417334.251720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417334.402691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417334.505081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417334.635248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417334.762201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417334.888051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417335.013938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417335.152292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417335.287377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417335.415831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417335.548981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417335.676746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417335.807385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417335.946433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417336.074345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417336.204623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417336.334594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417336.454421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417336.581635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417336.708187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417336.841696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417336.966201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417337.108620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417337.238997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417337.375791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417337.513444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417337.631019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417337.770733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417337.886997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417338.016560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417338.154311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417338.294043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417338.425808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417338.554472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417338.688030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417338.819521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417338.952110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417339.071376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417339.199495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417339.341300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417339.465566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417339.597245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417339.718992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417339.858768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417340.003361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417340.140877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417340.271170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417340.418581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417340.530085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417340.669098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417340.806133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417340.927705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417341.073305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417341.211903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417341.318668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417341.447505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417341.583269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417341.722362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417341.850257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417342.016808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417342.135994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417342.262180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417342.386815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417342.511655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417342.636832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417342.764394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417342.901448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417343.027564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417343.162355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417343.303312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417343.428916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417343.557131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417343.682855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417343.824009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417343.953870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417344.080344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417344.213916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417344.348689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417344.491321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417344.597958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417344.738334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417344.874470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417344.999852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417345.132645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417345.252893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417345.381416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417345.515102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417345.643299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417345.777119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417345.905530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417346.051547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417346.185983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417346.313973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417346.465705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417346.576770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417346.700939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417346.832121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417346.957731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417347.084577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417347.223983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417347.359390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417347.487806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417347.622603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417347.765237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417347.890311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417348.023937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417348.146159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417348.275709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417348.403375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417348.566474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417348.690198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417348.817899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417348.937853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417349.067901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417349.193510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417349.339680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417349.446306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417349.575331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417349.716435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417349.829696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417349.967253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417350.080104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417350.217139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417350.350618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417350.482958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417350.619712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417350.747066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417350.882436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417351.008155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417351.136139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417351.259590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417351.391627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417351.525564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417351.640553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417351.764149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417351.901155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417352.039196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417352.169221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417352.303597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417352.434309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417352.557266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417352.688149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417352.821823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417352.950652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417353.071501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417353.201891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417353.328085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417353.449917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417353.578366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417353.722959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417353.843098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417353.968155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417354.094939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417354.224938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417354.361468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417354.498021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417354.626641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417354.774093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417354.968443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417355.106919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417355.242104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417355.374509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417355.511202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417355.627554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417355.770372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417355.936193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417356.052037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417356.180224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417356.314821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417356.444255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417356.582626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417356.699618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417356.825162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417356.957155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417357.087849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417357.233013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417357.345573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417357.489581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417357.619934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417357.756761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417357.873346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417358.011202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417358.134972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417358.262822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417358.385058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417358.519880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417358.659657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417358.777474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417358.906681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417359.050866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417359.176201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417359.315972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417359.440070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417359.573237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417359.698857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417359.824931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417359.951890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417360.093677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417360.206819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417360.334997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417360.460021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417360.589699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417360.719636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417360.863425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417361.001013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417361.151812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417361.261508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417361.383709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417361.511246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417361.654368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417361.775040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417361.903695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417362.030836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417362.177101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417362.298398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417362.425049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417362.560616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417362.694616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417362.823409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417362.954264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417363.093904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417363.230562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417363.362705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417363.495331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417363.624253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417363.774193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417363.900272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417364.007778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417364.142922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417364.262597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417364.395075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417364.511369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417364.632947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417364.766354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417364.881319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417365.017143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417365.135412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417365.269918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417365.390741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417365.518987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417365.654264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417365.784603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417365.920891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417366.061445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417366.189496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417366.326902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417366.450372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417366.599170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417366.721990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417366.834068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417366.968924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417367.108527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417367.238260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417367.388211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417367.519636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417367.654613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417367.774942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417367.926933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417368.060658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417368.187037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417368.314095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417368.466260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417368.572691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417368.700711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417368.827571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417368.961648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417369.088389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417369.219463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417369.350043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417369.488873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417369.619694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417369.759667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417369.880293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417370.009814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417370.150435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417370.284122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417370.392399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417370.527797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417370.670067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417370.805797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417370.934906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417371.080901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417371.192785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417371.328466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417371.453760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417371.591015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417371.721719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417371.864867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417372.020193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417372.146708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417372.271066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417372.401141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417372.528720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417372.681116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417372.804070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417372.942992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417373.057711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417373.192507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417373.319487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417373.448665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417373.568032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417373.700195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417373.823380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417373.973280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417374.078196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417374.222493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417374.348603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417374.488003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417374.618342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417374.757286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417374.875624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417375.007492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417375.131933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417375.257665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417375.394340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417375.509481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417375.644172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417375.777813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417375.888856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417376.023721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417376.143811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417376.276491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417376.402138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417376.527714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417376.651349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417376.785045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417376.915260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417377.065981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417377.180929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417377.322454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417377.443058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417377.573410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417377.706533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417377.843551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417377.978313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417378.113076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417378.236844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417378.358036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417378.501214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417378.633448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417378.763251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417378.894986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417379.006294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417379.154876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417379.264697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417379.389855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417379.524491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417379.679032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417379.783944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417379.931546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417380.063625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417380.199157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417380.328191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417380.477605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417380.586576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417380.729283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417380.859159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417380.982174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417381.122526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417381.261258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417381.383040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417381.526651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417381.634678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417381.773838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417381.902775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417382.026720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417382.164718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417382.302044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417382.429417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417382.555809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417382.678455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417382.815077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417382.931767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417383.068017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417383.195439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417383.321470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417383.464098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417383.577408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417383.702778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417383.837825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417383.962119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417384.106568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417384.231851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417384.369838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417384.494771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417384.623666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417384.755805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417384.884085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417385.002864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417385.150866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417385.254390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417385.386292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417385.504577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417385.650470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417385.773091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417385.887333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417386.014310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417386.139641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417386.260973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417386.395245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417386.523565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417386.652199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417386.796424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417386.926204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417387.053025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417387.183976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417387.318581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417387.454723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417387.575635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417387.703585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417387.824866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417387.953727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417388.080680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417388.216809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417388.352362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417388.501796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417388.622734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417388.751311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417388.891209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417389.020901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417389.133263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417389.251879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417389.388858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417389.542509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417389.649604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417389.790830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417389.916489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417390.044626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417390.187384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417390.317006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417390.438831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417390.580940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417390.691372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417390.847113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417390.968087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417391.079009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417391.214013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417391.354547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417391.489796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417391.626033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417391.742177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417391.882478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417392.005046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417392.134771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417392.258838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417392.391206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417392.515337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417392.659385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417392.769171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417392.904347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417393.195146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417393.465095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417393.810047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417394.171725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417394.505092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417394.871657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417395.136731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417395.585727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417395.750702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417395.900561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417396.076148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417396.274672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417396.492108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417396.702979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417396.888174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417397.049898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417397.218810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417397.369568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417397.544905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417397.740629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417397.890150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417398.061356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417398.214364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417398.403425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417398.559653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417398.723089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417398.900428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417399.073053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417399.245139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417399.455126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417399.593113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417399.760761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417399.951586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417400.137991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417400.288549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417400.489277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417400.635531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417400.817509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417400.953239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417401.123309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417401.299377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417401.472942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417401.703917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417401.903412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417402.113576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417402.309811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417402.512978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417402.676474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417402.866489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417403.068789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417403.236071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417403.375519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417403.567174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417403.977887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417404.142989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417404.286096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417404.427713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417404.574851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417404.689829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417404.829422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417404.973069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417405.152071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417405.330012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417405.512618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417405.676477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417405.838215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417406.016421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417406.151033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417406.330463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417406.500560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417406.668288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417406.833302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417407.049622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417407.172500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417407.359863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417407.547753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417407.699772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417407.884354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417408.062501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417408.196768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417408.381851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417408.548675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417408.711835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417408.873158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417409.087629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417409.213632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417409.402348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417409.567974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417409.830771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417410.172346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417410.440375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417410.597168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417410.743041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417410.890295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417411.014472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417411.141015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417411.297698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417411.413219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417411.548177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417411.666347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417411.839687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417411.945555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417412.075482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417412.200079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417412.327387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417412.450329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417412.585831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417412.712708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417412.869986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417413.090569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417413.235788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417413.354380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417413.481470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417413.628725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417413.760080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417413.885720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417414.010521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417414.155506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417414.295409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417414.401792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417414.545613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417414.681242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417414.806136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417414.943269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417415.068943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417415.195367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417415.324351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417415.446058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417415.568901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417415.715351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417415.824311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417415.957864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417416.090545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417416.235667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417416.357877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417416.479303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417416.625869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417416.757446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417416.877775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417417.006063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417417.144672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417417.277726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417417.385328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417417.512260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417417.644467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417417.788689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417417.920778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417418.071258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417418.197657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417418.325105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417418.467575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417418.594636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417418.725907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417418.867992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417419.000351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417419.133649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417419.257838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417419.382231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417419.509265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417419.637059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417419.764131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417419.896590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417420.023686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417420.173196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417420.311041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417420.442525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417420.567237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417420.688452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417420.815368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417420.944410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417421.068064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417421.202472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417421.320929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417421.448242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417421.589282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417421.714789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417421.852359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417421.990635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417422.123142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417422.253339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417422.376898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417422.519622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417422.635139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417422.774607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417422.886024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417423.016722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417423.149304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417423.303989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417423.429363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417423.561203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417423.692447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417423.826053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417423.948155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417424.078011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417424.211391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417424.327054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417424.452066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417424.579193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417424.712235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417424.835160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417424.961233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417425.101270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417425.235138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417425.360707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417425.497999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417425.626024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417425.764581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417425.892737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417426.026860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417426.155963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417426.295622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417426.422043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417426.568546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417426.694379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417426.819466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417426.946334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417427.068833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417427.195748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417427.324069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417427.466100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417427.608709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417427.712243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417427.845616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417427.977747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417428.114842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417428.257132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417428.388036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417428.512709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417428.637356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417428.760996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417428.902795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417429.047210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417429.182438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417429.312407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417429.440846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417429.577336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417429.707015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417429.845366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417429.983182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417430.120611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417430.244157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417430.376595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417430.504082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417430.650912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417430.760926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417430.892755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417431.024790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417431.173894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417431.302503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417431.448406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417431.568430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417431.698827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417431.819746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417431.947672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417432.067607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417432.195349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417432.320971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417432.449047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417432.571983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417432.698802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417432.820117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417432.947592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417433.089701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417433.207264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417433.331312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417433.466729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417433.598884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417433.738267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417433.867991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417434.004834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417434.125891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417434.254320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417434.386145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417434.517711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417434.653243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417434.782324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417434.902825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417435.033551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417435.181558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417435.298170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417435.434630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417435.591764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417435.762316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417435.896782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417436.027484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417436.165354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417436.292719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417436.435794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417436.556584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417436.689252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417436.808283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417436.944287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417437.074380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417437.203749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417437.321116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417437.447298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417437.571436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417437.705967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417437.835271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417437.970811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417438.093975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417438.239973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417438.362961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417438.513660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417438.628698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417438.779103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417438.886294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417439.012421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417439.142647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417439.278391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417439.409103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417439.554007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417439.686333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417439.837260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417439.941984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417440.066700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417440.201899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417440.337957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417440.459246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417440.612387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417440.718958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417440.867899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417440.987823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417441.125858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417441.255080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417441.382124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417441.512156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417441.638404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417441.796747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417441.935605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417442.056638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417442.183449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417442.314147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417442.447197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417442.564371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417442.696533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417442.813808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417442.944457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417443.067431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417443.198536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417443.324152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417443.451884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417443.588293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417443.705569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417443.830722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417443.987707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417444.105782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417444.253175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417444.376373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417444.500414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417444.629803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417444.765611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417444.880726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417445.011526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417445.141187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417445.282413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417445.391355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417445.524648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417445.669920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417445.807467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417445.929263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417446.068803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417446.192792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417446.334708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417446.437235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417446.579374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417446.700943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417446.837004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417446.964006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417447.087193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417447.211911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417447.344339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417447.485072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417447.621675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417447.746419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417447.877625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417447.996434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417448.137858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417448.274638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417448.424133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417448.564553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417448.692856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417448.812433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417448.944461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417449.068499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417449.194452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417449.316457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417449.452547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417449.584746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417449.722131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417449.828979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417449.960025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417450.094915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417450.217364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417450.357036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417450.485861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417450.627878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417450.755546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417450.879141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417451.008325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417451.149296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417451.260364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417451.383810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417451.515608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417451.632271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417451.762459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417451.905236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417452.026316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417452.148864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417452.289554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417452.422616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417452.566535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417452.680522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417452.814410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417452.952499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417453.066832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417453.193547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417453.317614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417453.439734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417453.568715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417453.685134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417453.946193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417454.080776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417454.239974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417454.355594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417454.490309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417454.622908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417454.758673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417454.885415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417455.007353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417455.138965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417455.263519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417455.383037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417455.527870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417455.639701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417455.766279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417455.901271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417456.046627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417456.165878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417456.315109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417456.448176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417456.574759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417456.693686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417456.843626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417456.951079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417457.079893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417457.227402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417457.364209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417457.495250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417457.647383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417457.755038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417457.888974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417458.015298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417458.150042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417458.273281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417458.402598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417458.537628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417458.675244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417458.801989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417458.938289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417459.062642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417459.197597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417459.320112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417459.448650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417459.577200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417459.723797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417459.831977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417460.024982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417460.134611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417460.259195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417460.390541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417460.522889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417460.655190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417460.806842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417460.925073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417461.065175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417461.205238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417461.327976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417461.447803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417461.584992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417461.710735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417461.842013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417462.013129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417462.136109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417462.260082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417462.389858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417462.516074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417462.645941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417462.784543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417462.930589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417463.053864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417463.185560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417463.319146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417463.444443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417463.588089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417463.696982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417463.826038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417463.964640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417464.100311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417464.247432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417464.371533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417464.501811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417464.621306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417464.754491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417464.881628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417465.004924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417465.146489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417465.278477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417465.381612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417465.507174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417465.647680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417465.763722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417465.891980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417466.025599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417466.147096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417466.280087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417466.419112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417466.547961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417466.680539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417466.814043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417466.952783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417467.070550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417467.210006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417467.323686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417467.446129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417467.589139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417467.713466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417467.828785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417467.977660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417468.128617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417468.248328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417468.380434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417468.507201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417468.636481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417468.763176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417468.903146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417469.029330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417469.152652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417469.277547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417469.412210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417469.544920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417469.679231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417469.818320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417469.946293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417470.081278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417470.208183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417470.327085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417470.462295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417470.590282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417470.733055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417470.867048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417471.004826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417471.127629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417471.259386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417471.382597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417471.498957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417471.632962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417471.759182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417471.884044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417472.009414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417472.148638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417472.263829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417472.402566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417472.521276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417472.650766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417472.776211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417472.912403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417473.046210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417473.172755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417473.315500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417473.445359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417473.565825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417473.690885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417473.839272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417473.944799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417474.071592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417474.205476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417474.338162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417474.464140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417474.607756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417474.741179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417474.875603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417474.993761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417475.130401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417475.262790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417475.396476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417475.511454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417475.630129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417475.768879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417475.897517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417476.046048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417476.171569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417476.299334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417476.452039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417476.574419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417476.701888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417476.835055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417476.981303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417477.100655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417477.246934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417477.373339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417477.505558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417477.630595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417477.760110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417477.889728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417478.009745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417478.135323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417478.258616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417478.380324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417478.503547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417478.628364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417478.771743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417478.884278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417479.011165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417479.137494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417479.266971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417479.386075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417479.533575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417479.647524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417479.773521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417479.915808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417480.062045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417480.194867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417480.323939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417480.451019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417480.592692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417480.711043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417480.861074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417480.982164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417481.109558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417481.256258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417481.387739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417481.505736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417481.630702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417481.755515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417481.886184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417482.010604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417482.136556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417482.273793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417482.422994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417482.543958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417482.693159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417482.815368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417482.953685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417483.061500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417483.196198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417483.315145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417483.446783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417483.592867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417483.713732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417483.840603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417483.981993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417484.118952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417484.251476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417484.397544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417484.522840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417484.636731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417484.767493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417484.890155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417485.026763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417485.148643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417485.283427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417485.423615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417485.561918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417485.689070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417485.815695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417485.947469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417486.066273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417486.202163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417486.401732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417486.629499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417486.890375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417487.196428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417487.343730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417487.487099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417487.611612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417487.755755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417487.882262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417488.007505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417488.118753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417488.248643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417488.382750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417488.519480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417488.634732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417488.754674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417488.884507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417489.015154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417489.146962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417489.276364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417489.420459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417489.565525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417489.692256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417489.820492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417489.949353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417490.090546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417490.200461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417490.330419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417490.460524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417490.609669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417490.737757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417490.876144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417491.000700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417491.122069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417491.254036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417491.380091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417491.495543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417491.628612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417491.757357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417491.889536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417492.023130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417492.175523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417492.360378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417492.488031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417492.610551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417492.751436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417492.871269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417493.015356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417493.126784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417493.251076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417493.383179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417493.510614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417493.649275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417493.791025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417493.902064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417494.042647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417494.162968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417494.298840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417494.426259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417494.567892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417494.688442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417494.817850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417494.939320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417495.068427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417495.193410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417495.336970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417495.452975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417495.576216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417495.700104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417495.833909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417495.971342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417496.113941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417496.239189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417496.376497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417496.498395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417496.626337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417496.750360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417496.901110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417497.005362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417497.130260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417497.250918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417497.374612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417497.503337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417497.632187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417497.754206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417497.877629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417498.002934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417498.151679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417498.272700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417498.391218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417498.521460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417498.653797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417498.793663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417498.924313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417499.054327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417499.190280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417499.327751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417499.444162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417499.564604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417499.692599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417499.823604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417499.955232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417500.079559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417500.221118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417500.348135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417500.485371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417500.616958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417500.749118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417500.880078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417501.012333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417501.135241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417501.263178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417501.391093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417501.518825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417501.651610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417501.799051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417501.914718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417502.051033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417502.260146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417502.402465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417502.525767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417502.663448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417502.800140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417502.935330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417503.070322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417503.189519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417503.319551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417503.446882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417503.575767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417503.707506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417503.836290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417503.975500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417504.112302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417504.250185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417504.375227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417504.503963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417504.633493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417504.759341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417504.886887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417505.005183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417505.147830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417505.263540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417505.397286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417505.536295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417505.659008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417505.798456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417505.923530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417506.064641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417506.195421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417506.317511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417506.467371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417506.575836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417506.731735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417506.837061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417506.961712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417507.102632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417507.245636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417507.380334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417507.515577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417507.628124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417507.760037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417507.887895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417508.021939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417508.149750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417508.286711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417508.437128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417508.552477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417508.691839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417508.825030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417508.938977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417509.075010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417509.194648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417509.317312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417509.442092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417509.574797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417509.696307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417509.823249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417509.950029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417510.085109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417510.226170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417510.365122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417510.495250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417510.642868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417510.756477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417510.880673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417511.012990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417511.149245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417511.265804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417511.400389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417511.534298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417511.675854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417511.819099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417511.942133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417512.066587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417512.194574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417512.333224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417512.440722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417512.567248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417512.694969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417512.837896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417512.953602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417513.072815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417513.208300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417513.344110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417513.470043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417513.605977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417513.735050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417513.871071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417514.006634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417514.128160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417514.255893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417514.394624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417514.508175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417514.635937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417514.761084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417514.897621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417515.031332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417515.188716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417515.300938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417515.441553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417515.576176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417515.689628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417515.840961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417515.950818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417516.093035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417516.204694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417516.343126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417516.487408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417516.608984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417516.746233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417516.879868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417517.020511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417517.132619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417517.254627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417517.383586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417517.505773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417517.645570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417517.759012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417517.891905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417518.022975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417518.151617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417518.279863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417518.412089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417518.541645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417518.689282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417518.814014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417518.940934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417519.076131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417519.195307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417519.321681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417519.475061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417519.592991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417519.734223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417519.873883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417520.023494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417520.133865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417520.258719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417520.386803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417520.517159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417520.637859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417520.772519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417520.899361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417521.049100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417521.175503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417521.313434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417521.434544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417521.560418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417521.700971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417521.830642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417521.965616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417522.110107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417522.234139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417522.369895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417522.498575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417522.627865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417522.752419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417522.882062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417523.009489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417523.159935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417523.285004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417523.406937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417523.549569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417523.688674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417523.813199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417523.951166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417524.081627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417524.221992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417524.357617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417524.480225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417524.607040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417524.736801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417524.863707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417524.988682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417525.125473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417525.258797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417525.385674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417525.518467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417525.640721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417525.784847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417525.921951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417526.046927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417526.171476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417526.299170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417526.439278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417526.581868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417526.696867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417526.826250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417526.950211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417527.086704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417527.212285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417527.377368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417527.484225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417527.608179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417527.739440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417527.873137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417528.009366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417528.143692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417528.267846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417528.398304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417528.525699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417528.669316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417528.810521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417528.932764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417529.046893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417529.189441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417529.313145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417529.444321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417529.565607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417529.693777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417529.816969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417529.945485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417530.068155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417530.201262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417530.321018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417530.457991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417530.592523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417530.733847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417530.856415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417531.004975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417531.120090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417531.269882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417531.377691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417531.517921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417531.631607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417531.768359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417531.885040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417532.020891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417532.147103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417532.293289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417532.423071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417532.571652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417532.707063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417532.827511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417532.964994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417533.102231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417533.233652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417533.391908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417533.564108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417533.699931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417533.819080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417533.952323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417534.071741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417534.200876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417534.330920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417534.460089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417534.585560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417534.722296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417534.853549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417534.990823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417535.133939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417535.252666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417535.381135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417535.504875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417535.631357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417535.759840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417535.889952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417536.044124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417536.180954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417536.317294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417536.436883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417536.562979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417536.690552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417536.822883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417536.951287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417537.074353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417537.210734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417537.321007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417537.448642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417537.603950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417537.741173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417537.860808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417537.990592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417538.127646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417538.241869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417538.377702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417538.496196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417538.626650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417538.756343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417538.883518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417539.002557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417539.134921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417539.268295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417539.395530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417539.519039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417539.674357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417539.809368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417539.940914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417540.075459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417540.211703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417540.325795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417540.453991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417540.583220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417540.720437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417540.852132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417540.994521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417541.118503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417541.252193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417541.387054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417541.509423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417541.624302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417541.774458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417541.888362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417542.022061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417542.148813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417542.288264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417542.418724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417542.559305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417542.677840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417542.810171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417542.937992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417543.066928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417543.189599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417543.319987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417543.459779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417543.572948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417543.695447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417543.831692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417543.960256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417544.121844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417544.233459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417544.364801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417544.487734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417544.616773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417544.744434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417544.871033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417544.988013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417545.143560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417545.247667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417545.380093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417545.499292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417545.633821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417545.759297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417545.890674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417546.014615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417546.149828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417546.272828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417546.404885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417546.542691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417546.685194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417546.810166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417546.940848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417547.063397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417547.194517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417547.318983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417547.457680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417547.577554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417547.726944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417547.836292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417547.984720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417548.111117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417548.246856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417548.373332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417548.507020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417548.627095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417548.755390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417548.887257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417549.023012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417549.157056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417549.290824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417549.406423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417549.562985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417549.678678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417549.807782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417549.939106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417550.074868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417550.194363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417550.331359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417550.456180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417550.590775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417550.749647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417550.853135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417550.998023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417551.130257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417551.267157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417551.387775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417551.510912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417551.651932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417551.795750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417551.936167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417552.081150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417552.238009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417552.362423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417552.499945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417552.617834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417552.746190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417552.869110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417553.002438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417553.119676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417553.250120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417553.376540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417553.522363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417553.632764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417553.771660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417553.889613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417554.020496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417554.151277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417554.284089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417554.422798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417554.563743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417554.686208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417554.807224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417554.940094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417555.078679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417555.206429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417555.335672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417555.456325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417555.581742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417555.712877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417555.849373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417555.985282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417556.128270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417556.254422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417556.396245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417556.506653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417556.643576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417556.761441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417556.888766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417557.021926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417557.151935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417557.291635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417557.435189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417557.568736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417557.688818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417557.814654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417557.939347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417558.066280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417558.210373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417558.320624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417558.443872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417558.585730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417558.734644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417558.870717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417559.006136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417559.128491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417559.255324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417559.384520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417559.508237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417559.627831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417559.758462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417559.887268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417560.010696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417560.140828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417560.271894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417560.404196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417560.554124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417560.674710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417560.805230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417560.927703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417561.065589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417561.188263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417561.320090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417561.439562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417561.582790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417561.696929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417561.831425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417561.970386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417562.108628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417562.242643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417562.372449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417562.493424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417562.628632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417562.773776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417562.892429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417563.018861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417563.147584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417563.270865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417563.398227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417563.543473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417563.668164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417563.802811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417563.935289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417564.082801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417564.194825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417564.318452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417564.441337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417564.579394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417564.713111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417564.830363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417564.979125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417565.105827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417565.247807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417565.377112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417565.512521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417565.637301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417565.765294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417565.885827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417566.022631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417566.158716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417566.300307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417566.430545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417566.559901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417566.688185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417566.817216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417566.946196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417567.094976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417567.215140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417567.337103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417567.451885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417567.585814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417567.722683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417567.856292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417567.988192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417568.123611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417568.242405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417568.378921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417568.502649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417568.636081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417568.758104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417568.893082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417569.015325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417569.168131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417569.285749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417569.427197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417569.553281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417569.682805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417569.800451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417569.939770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417570.058844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417570.193040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417570.319286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417570.445891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417570.573261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417570.701674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417570.826937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417570.961215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417571.103124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417571.244524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417571.367698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417571.521520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417571.626021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417571.762701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417571.881877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417572.014937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417572.142117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417572.275350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417572.411360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417572.557547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417572.680398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417572.798757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417572.932701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417573.072942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417573.200398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417573.372870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417573.644224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417573.944857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417574.249487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417574.607774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417574.996536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417575.312092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417575.540070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417575.895670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417576.183091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417576.348375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417576.522441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417576.762068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417577.011476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417577.200742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417577.360527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417577.510357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417577.693821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417577.871870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417578.043057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417578.186642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417578.369972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417578.543357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417578.725234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417578.928015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417579.075933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417579.244545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417579.416762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417579.585909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417579.753058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417579.933947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417580.100047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417580.272571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417580.460852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417580.628329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417580.768371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417580.949142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417581.144490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417581.317685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417581.489204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417581.635394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417581.815912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417582.022213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417582.302545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417582.505501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417582.633801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417582.805006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417582.954282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417583.136829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417583.281089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417583.439385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417583.616563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417583.769727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417583.947577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417584.110310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417584.449604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417584.710438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417584.876145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417585.014186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417585.147840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417585.281248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417585.430915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417585.582829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417585.730224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417585.943071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417586.081656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417586.256570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417586.429097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417586.573035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417586.758454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417586.967135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417587.148656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417587.305414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417587.450702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417587.659592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417587.835096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417587.984036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417588.145781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417588.321192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417588.494761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417588.693815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417588.822455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417588.999946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417589.172777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417589.354921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417589.496319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417589.702666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417589.896894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417590.009890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417590.187627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417590.382104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417590.751750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417590.960867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417591.236447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417591.375555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417591.528746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417591.649186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417591.803944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417591.912251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417592.065154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417592.199545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417592.316633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417592.443618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417592.573899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417592.706938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417592.824881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417592.955908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417593.105230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417593.221907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417593.358429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417593.515681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417593.698487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417593.879537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417594.004554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417594.132872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417594.259566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417594.385712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417594.539246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417594.669271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417594.807615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417594.934289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417595.068292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417595.190222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417595.319548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417595.442345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417595.566586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417595.690637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417595.836058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417595.947145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417596.083309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417596.215632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417596.353992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417596.491428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417596.611267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417596.745208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417596.873253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417596.998724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417597.131363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417597.259420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417597.382355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417597.506866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417597.644887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417597.767092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417597.910143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417598.041539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417598.180392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417598.306613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417598.444881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417598.579505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417598.705007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417598.846153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417598.985634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417599.105156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417599.249583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417599.373545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417599.502247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417599.636506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417599.758524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417599.888068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417600.019867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417600.188966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417600.326572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417600.444361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417600.569293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417600.696935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417600.840890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417600.977192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417601.113499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417601.234112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417601.368478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417601.497150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417601.626171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417601.744547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417601.881562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417602.010544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417602.143202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417602.273201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417602.417204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417602.554330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417602.687208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417602.811353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417602.946453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417603.081659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417603.197426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417603.334830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417603.455413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417603.574978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417603.731810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417603.852532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417604.000546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417604.131686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417604.247208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417604.372376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417604.503133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417604.628350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417604.750707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417604.877252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417605.004513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417605.133980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417605.261654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417605.392658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417605.539913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417605.664986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417605.794965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417605.916084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417606.057652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417606.179425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417606.311358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417606.445955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417606.581764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417606.726985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417606.877630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417606.996644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417607.126346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417607.264114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417607.376368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417607.503068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417607.629075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417607.755828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417607.882299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417608.011179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417608.169408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417608.281820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417608.422092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417608.554303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417608.689993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417608.810060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417608.939124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417609.076027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417609.213361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417609.331667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417609.460352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417609.592661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417609.735269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417609.871261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417609.999832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417610.123703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417610.254648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417610.397270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417610.537583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417610.670444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417610.807578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417610.936547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417611.071586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417611.200202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417611.333077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417611.461538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417611.595946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417611.730117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417611.868358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417612.001034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417612.128258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417612.255470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417612.376749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417612.499266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417612.623746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417612.751825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417612.877636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417613.000274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417613.141494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417613.253626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417613.379301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417613.507500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417613.632466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417613.761541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417613.921176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417614.041541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417614.172575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417614.310782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417614.433436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417614.565436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417614.687234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417614.811514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417614.956281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417615.075076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417615.204277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417615.331067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417615.470892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417615.604443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417615.746881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417615.867867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417615.993507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417616.122585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417616.270039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417616.374669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417616.506624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417616.729941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417616.853139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417616.985146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417617.107798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417617.251328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417617.376258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417617.502500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417617.622427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417617.744633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417617.874753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417618.012198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417618.126130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417618.254734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417618.393124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417618.515427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417618.632208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417618.776264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417618.904112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417619.043012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417619.173821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417619.312002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417619.451895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417619.568903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417619.694456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417619.822585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417619.959395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417620.095418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417620.237118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417620.370740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417620.489709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417620.626003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417620.743245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417620.891960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417620.999649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417621.143730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417621.270118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417621.395488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417621.525510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417621.658838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417621.789774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417621.929718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417622.055636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417622.182669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417622.310616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417622.449882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417622.578664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417622.736821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417622.852331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417622.986242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417623.121480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417623.267596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417623.372858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417623.517453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417623.632704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417623.766971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417623.902377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417624.023432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417624.157526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417624.298745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417624.415565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417624.571824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417624.675541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417624.820399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417624.944149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417625.072258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417625.192868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417625.322325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417625.445683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417625.579542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417625.709024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417625.854275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417625.978898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417626.118503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417626.255323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417626.378552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417626.516979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417626.632146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417626.758962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417626.895637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417627.026158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417627.174358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417627.307200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417627.443038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417627.567376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417627.688887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417627.814421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417627.940502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417628.057163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417628.194024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417628.317502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417628.447015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417628.575362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417628.716834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417628.865630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417629.001281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417629.127491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417629.258388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417629.392857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417629.516517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417629.643390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417629.773295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417629.908185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417630.044473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417630.180670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417630.322551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417630.434580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417630.562294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417630.686469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417630.818470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417630.942816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417631.066585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417631.196451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417631.364945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417631.494219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417631.634957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417631.756896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417631.878577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417632.018724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417632.147068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417632.262979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417632.390431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417632.518303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417632.659721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417632.791950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417632.917679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417633.045513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417633.171163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417633.308642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417633.442682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417633.580185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417633.694683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417633.819395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417633.945096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417634.071196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417634.265763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417634.472131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417634.619134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417634.746246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417634.866605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417635.005590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417635.124076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417635.257977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417635.407099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417635.533271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417635.670495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417635.808622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417635.941181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417636.066485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417636.187361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417636.325932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417636.444400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417636.580346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417636.703087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417636.854162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417636.995616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417637.119701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417637.249796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417637.378379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417637.498412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417637.631872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417637.755443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417637.891413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417638.019598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417638.167774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417638.309941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417638.443100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417638.558767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417638.691360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417638.817411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417638.945295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417639.067183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417639.210874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417639.330380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417639.456259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417639.598103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417639.731156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417639.870805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417640.011880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417640.145167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417640.262493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417640.387225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417640.523597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417640.668870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417640.815107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417640.947212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417641.067605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417641.195232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417641.331331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417641.460786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417641.600876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417641.731781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417641.859610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417642.009213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417642.146197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417642.270427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417642.400973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417642.525337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417642.668216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417642.800472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417642.930383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417643.056715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417643.188165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417643.312736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417643.442336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417643.568501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417643.702285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417643.846066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417643.976939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417644.106356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417644.240940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417644.373631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417644.501148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417644.640850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417644.757807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417644.881981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417645.015835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417645.135506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417645.266917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417645.392832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417645.538618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417645.655591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417645.810715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417645.926490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417646.060121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417646.190153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417646.316511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417646.437068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417646.566923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417646.692038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417646.822093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417646.961203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417647.091762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417647.235488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417647.366051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417647.486418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417647.622091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417647.739546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417647.870412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417648.012886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417648.157007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417648.283763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417648.426053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417648.548182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417648.688706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417648.812932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417648.945049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417649.067508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417649.206190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417649.336475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417649.484245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417649.604183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417649.734230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417649.882424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417650.009860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417650.119384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417650.259572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417650.374301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417650.519414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417650.633169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417650.761470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417650.884470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417651.019259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417651.149077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417651.309919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417651.433078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417651.578822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417651.684495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417651.822953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417651.938924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417652.073748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417652.209827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417652.328597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417652.455629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417652.609757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417652.725174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417652.874523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417652.990242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417653.128352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417653.254795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417653.390467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417653.512542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417653.651600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417653.790353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417653.938097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417654.062586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417654.190599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417654.314380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417654.443220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417654.568773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417654.695612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417654.821748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417654.954587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417655.077818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417655.210265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417655.355273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417655.502769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417655.621531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417655.749670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417655.886599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417656.027635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417656.161047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417656.282961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417656.420557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417656.558296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417656.678061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417656.810476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417656.932135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417657.071119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417657.189844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417657.319346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417657.463386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417657.595347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417657.737500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417657.877190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417658.001942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417658.127997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417658.264048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417658.386750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417658.514125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417658.662850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417658.780083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417658.920092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417659.060995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417659.190270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417659.330701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417659.456974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417659.579628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417659.710013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417659.843925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417659.971152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417660.110148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417660.241617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417660.364777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417660.496379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417660.631199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417660.753996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417660.877245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417661.009887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417661.140539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417661.265763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417661.395463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417661.542766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417661.677593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417661.832364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417661.931206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417662.068787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417662.194372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417662.329511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417662.461906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417662.607184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417662.736071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417662.876869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417663.015292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417663.128428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417663.249848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417663.390847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417663.498702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417663.622810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417663.753532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417663.903279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417664.022064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417664.155493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417664.288285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417664.417859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417664.553765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417664.684802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417664.813857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417664.934270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417665.060842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417665.197137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417665.314232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417665.462952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417665.570972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417665.729003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417665.841802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417665.978454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417666.111272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417666.255439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417666.365950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417666.501477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417666.625521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417666.756935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417666.878093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417667.018154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417667.135690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417667.268757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417667.405260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417667.522689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417667.664002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417667.810429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417667.952112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417668.066507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417668.187410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417668.316303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417668.437696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417668.568733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417668.690466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417668.828947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417668.977008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417669.088483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417669.240273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417669.384499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417669.495739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417669.619976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417669.767864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417669.889481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417670.006988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417670.132639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417670.274047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417670.385064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417670.505084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417670.635406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417670.761080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417670.891314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417671.023215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417671.162116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417671.291033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417671.415135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417671.557853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417671.682613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417671.805928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417671.937133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417672.071067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417672.217139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417672.347278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417672.471150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417672.592420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417672.730083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417672.850240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417672.982961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417673.116301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417673.243333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417673.370063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417673.496656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417673.616623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417673.752332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417673.884476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417674.031779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417674.147631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417674.288851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417674.415436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417674.568946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417674.686720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417674.819925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417674.940570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417675.066382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417675.191218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417675.321647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417675.441617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417675.577649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417675.698339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417675.828257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417675.951615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417676.102374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417676.246581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417676.392633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417676.518875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417676.634374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417676.766319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417676.888984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417677.018995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417677.145203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417677.284513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417677.412856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417677.559845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417677.685229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417677.812133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417677.939412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417678.068030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417678.191770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417678.328134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417678.444249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417678.561044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417678.695077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417678.818661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417678.961513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417679.068709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417679.219295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417679.327291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417679.457781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417679.597687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417679.752797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417679.866343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417680.002944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417680.118320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417680.254267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417680.369874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417680.508959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417680.629770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417680.752443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417680.879502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417681.023858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417681.151737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417681.291570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417681.429661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417681.568675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417681.694502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417681.814658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417681.937189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417682.078860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417682.188187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417682.328495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417682.547243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417682.674796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417682.822514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417682.925953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417683.076709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417683.180430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417683.305929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417683.435328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417683.561540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417683.682756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417683.818195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417683.948868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417684.085850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417684.203946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417684.335414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417684.473199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417684.627564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417684.734742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417684.890808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417684.996361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417685.123182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417685.258656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417685.392087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417685.539426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417685.673137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417685.782901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417685.929924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417686.070594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417686.188719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417686.327462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417686.439373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417686.564702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417686.697530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417686.819649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417686.952912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417687.084308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417687.221041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417687.351367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417687.480180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417687.611730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417687.742128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417687.878453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417687.996439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417688.121983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417688.254908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417688.373655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417688.520943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417688.629608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417688.759083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417688.887011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417689.026529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417689.157579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417689.290643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417689.416888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417689.556974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417689.680455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417689.814781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417689.928675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417690.079007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417690.185971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417690.322537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417690.448360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417690.573282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417690.702396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417690.855942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417690.959668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417691.125495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417691.232602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417691.371740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417691.497714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417691.641522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417691.750850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417691.906754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417692.025885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417692.165004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417692.315111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417692.436741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417692.551689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417692.684765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417692.830668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417692.943645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417693.072587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417693.200938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417693.336069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417693.454872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417693.586807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417693.711297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417693.833185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417693.972203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417694.105714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417694.241598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417694.364835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417694.503295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417694.624363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417694.754255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417694.893281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417695.020137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417695.159624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417695.292485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417695.420438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417695.558882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417695.680559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417695.814661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417695.932019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417696.062876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417696.188711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417696.316737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417696.440755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417696.573798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417696.701631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417696.850215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417696.959037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417697.117929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417697.234385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417697.370598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417697.491850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417697.619287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417697.747832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417697.883945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417698.005087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417698.162725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417698.287381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417698.418359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417698.539929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417698.676911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417698.804425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417698.940468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417699.052113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417699.183264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417699.322029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417699.442896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417699.564073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417699.696164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417699.822032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417699.972091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417700.100687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417700.233816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417700.359714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417700.509248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417700.621320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417700.749008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417700.892006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417701.013179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417701.133491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417701.288575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417701.420977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417701.544499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417701.678613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417701.807011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417701.941828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417702.088717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417702.230110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417702.376958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417702.494422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417702.615496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417702.758912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417702.881101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417703.007193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417703.138161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417703.260186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417703.390631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417703.524210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417703.663722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417703.785084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417703.941246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417704.073471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417704.191803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417704.313639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417704.440000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417704.560159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417704.687899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417704.812044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417704.940641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417705.066144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417705.193984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417705.319949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417705.458324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417705.595863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417705.726056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417705.853579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417705.993118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417706.118988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417706.242034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417706.369695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417706.503815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417706.627201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417706.753936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417706.879333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417707.016302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417707.130087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417707.263572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417707.390178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417707.530165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417707.661523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417707.795069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417707.939613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417708.067582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417708.190116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417708.318248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417708.442680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417708.569932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417708.692214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417708.842970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417708.950155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417709.078091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417709.217668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417709.351545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417709.486861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417709.622889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417709.748416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417709.879496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417710.003477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417710.135682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417710.257853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417710.391595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417710.522393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417710.665501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417710.787156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417710.912710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417711.047862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417711.182743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417711.308741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417711.435784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417711.565198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417711.704962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417711.816135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417711.973585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417712.082029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417712.222855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417712.357041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417712.477963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417712.619451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417712.746813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417712.865596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417712.999475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417713.133489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417713.258315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417713.378515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417713.520369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417713.632087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417713.832917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417713.976470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417714.112098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417714.238181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417714.377962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417714.487223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417714.624314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417714.763566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417714.880944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417715.006504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417715.137558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417715.262330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417715.388039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417715.521144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417715.689890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417715.805261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417715.976797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417716.110467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417716.238662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417716.366844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417716.494701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417716.620192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417716.747266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417716.889876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417717.007097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417717.129202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417717.267303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417717.392623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417717.537163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417717.665749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417717.791481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417717.927302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417718.074442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417718.205323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417718.338962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417718.469680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417718.609811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417718.739335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417718.876041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417718.999710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417719.137355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417719.255561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417719.404629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417719.531716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417719.661078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417719.786640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417719.907157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417720.048069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417720.189596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417720.311112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417720.440316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417720.564133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417720.702545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417720.832208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417720.971792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417721.097445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417721.242339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417721.369238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417721.507934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417721.624171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417721.742246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417721.876915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417722.021098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417722.139341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417722.266543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417722.414350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417722.553025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417722.683688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417722.798260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417722.927139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417723.058659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417723.183774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417723.313497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417723.438205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417723.564930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417723.689187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417723.818615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417723.944123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417724.084178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417724.217929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417724.366044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417724.508443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417724.647110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417724.772308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417724.920997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417725.049318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417725.200154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417725.309192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417725.442569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417725.571802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417725.703576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417725.835219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417725.974634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417726.116041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417726.248581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417726.375344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417726.509996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417726.641990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417726.788689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417726.892912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417727.044312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417727.176918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417727.323055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417727.423913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417727.554724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417727.682547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417727.812948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417727.939877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417728.078892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417728.209584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417728.335014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417728.485089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417728.627846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417728.754595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417728.886421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417729.021513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417729.158817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417729.303085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417729.431614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417729.563336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417729.690373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417729.827200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417729.956417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417730.097428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417730.227507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417730.359200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417730.493181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417730.624532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417730.758305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417730.913060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417731.058841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417731.183247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417731.312297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417731.433954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417731.566509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417731.694155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417731.814427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417731.953493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417732.107274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417732.232672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417732.370201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417732.506852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417732.636774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417732.751044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417732.879415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417733.006911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417733.143947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417733.268478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417733.400200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417733.518969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417733.663823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417733.790421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417733.935498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417734.060632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417734.191338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417734.303609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417734.437688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417734.565314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417734.716347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417734.825647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417734.993403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417735.105815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417735.240006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417735.367285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417735.500731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417735.612813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417735.745764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417735.874032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417736.002833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417736.125629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417736.249046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417736.374258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417736.497507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417736.623241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417736.763595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417736.871135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417737.005021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417737.130497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417737.263545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417737.384215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417737.521663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417737.642314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417737.780763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417737.918506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417738.038943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417738.188989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417738.312467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417738.425130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417738.577096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417738.680651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417738.811342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417738.943480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417739.071471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417739.195419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417739.328401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417739.454068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417739.598666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417739.723043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417739.868560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417739.990792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417740.119194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417740.241125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417740.376543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417740.496732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417740.627493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417740.753623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417740.896666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417741.030956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417741.161349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417741.299669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417741.429927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417741.567461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417741.692088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417741.817884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417741.964239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417742.086138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417742.218228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417742.353683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417742.476906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417742.608047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417742.735663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417742.853582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417742.992256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417743.118015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417743.253331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417743.386676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417743.516271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417743.647849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417743.782589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417743.921638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417744.047498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417744.174862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417744.325437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417744.433622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417744.583968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417744.684656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417744.820261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417744.934287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417745.063935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417745.192753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417745.326108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417745.460543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417745.607553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417745.735253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417745.865592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417745.989226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417746.123645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417746.253891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417746.382272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417746.505250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417746.636697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417746.757626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417746.889993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417747.017851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417747.155126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417747.285144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417747.440096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417747.575729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417747.691814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417747.810060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417747.939661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417748.067094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417748.204172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417748.351127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417748.466833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417748.597751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417748.733286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417748.863614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417749.001811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417749.123301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417749.266078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417749.396334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417749.523172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417749.648567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417749.786775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417749.912766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417750.052729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417750.176124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417750.310814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417750.437271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417750.566036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417750.688972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417750.823256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417750.945362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417751.078753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417751.211400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417751.360530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417751.489947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417751.625749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417751.755760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417751.894855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417752.034034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417752.164019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417752.286431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417752.420617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417752.544780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417752.685636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417752.801538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417752.922122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417753.049730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417753.198597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417753.313031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417753.443345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417753.566742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417753.706007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417753.835608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417753.981841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417754.109056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417754.255172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417754.562147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417754.815966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417755.142210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417755.576885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417755.879146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417756.153033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417756.552207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417756.843477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417757.087041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417757.314812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417757.533745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417757.731279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417757.931481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417758.101285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417758.249002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417758.423404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417758.605282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417758.782334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417758.911521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417759.096776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417759.272326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417759.483045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417759.628336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417759.812912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417759.995538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417760.164160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417760.347478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417760.506044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417760.665632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417760.851138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417761.007451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417761.177194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417761.360654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417761.540837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417761.702496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417761.886221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417762.122288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417762.272271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417762.494490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417762.622541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417762.795717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417762.986956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417763.219341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417763.389349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417763.568326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417763.743628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417763.891927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417764.066290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417764.229303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417764.420242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417764.593471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417764.748684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417764.889246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417765.254369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417765.492214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417765.682612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417765.807831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417765.951379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417766.075980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417766.227030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417766.372726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417766.525513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417766.684902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417766.881302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417767.054581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417767.243168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417767.407565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417767.598991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417767.761962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417767.930435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417768.086527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417768.291226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417768.474573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417768.628030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417768.841151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417768.974551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417769.132143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417769.316315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417769.537272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417769.667415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417769.881228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417770.058830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417770.247732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417770.432750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417770.617220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417770.753943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417770.936969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417771.179399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417771.545503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417771.769532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417772.006475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417772.139016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417772.317753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417772.449983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417772.598108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417772.720445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417772.855304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417772.984188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417773.109961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417773.248082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417773.374091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417773.500083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417773.627076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417773.747178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417773.882362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417774.003864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417774.138300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417774.276474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417774.510230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417774.639441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417774.783331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417774.906402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417775.034348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417775.163029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417775.307365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417775.435302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417775.559758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417775.683712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417775.810848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417775.950137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417776.061715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417776.183379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417776.315736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417776.448333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417776.578041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417776.701624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417776.848970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417776.963237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417777.109265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417777.229336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417777.368421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417777.490042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417777.620807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417777.748831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417777.877621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417778.000962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417778.133312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417778.259715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417778.397709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417778.543500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417778.673626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417778.798657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417778.937776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417779.057930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417779.192858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417779.324887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417779.455146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417779.601928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417779.740453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417779.869903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417779.989717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417780.118487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417780.250533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417780.383057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417780.529272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417780.653084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417780.788347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417780.919486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417781.054661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417781.178965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417781.312109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417781.431586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417781.558477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417781.682353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417781.813884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417781.939377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417782.081246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417782.189049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417782.319369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417782.454397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417782.598068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417782.724674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417782.873311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417782.996918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417783.125268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417783.242704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417783.388334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417783.492906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417783.624646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417783.749574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417783.883672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417784.005808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417784.140560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417784.269805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417784.393721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417784.535146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417784.671368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417784.820274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417784.937761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417785.059809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417785.186641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417785.310099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417785.450252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417785.574209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417785.704941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417785.848782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417785.990313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417786.112737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417786.265090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417786.496561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417786.748006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417786.995436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417787.377435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417787.656140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417787.802794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417787.928095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417788.050228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417788.184310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417788.305976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417788.428801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417788.553420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417788.688982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417788.815574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417788.945203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417789.072472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417789.238477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417789.363278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417789.494981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417789.617012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417789.765006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417789.875952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417790.004595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417790.130146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417790.327849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417790.472079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417790.592993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417790.730989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417790.866480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417791.003946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417791.126289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417791.321085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417791.473026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417791.585005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417791.730074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417791.872875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417792.014337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417792.164280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417792.324832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417792.439039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417792.579689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417792.721776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417792.857326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417792.992661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417793.121418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417793.246253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417793.387959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417793.526503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417793.665943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417793.790071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417793.931124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417794.048821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417794.189884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417794.309338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417794.432782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417794.557851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417794.714009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417794.811735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417794.939959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417795.064020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417795.205814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417795.327891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417795.472839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417795.602645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417795.738478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417795.865567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417795.996630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417796.138411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417796.262652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417796.393862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417796.536964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417796.667479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417796.815309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417796.934157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417797.064109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417797.187629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417797.341291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417797.539355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417797.666997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417797.793650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417797.912446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417798.046406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417798.183262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417798.306788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417798.435535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417798.564076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417798.695307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417798.824569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417798.954307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417799.085518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417799.235848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417799.357741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417799.493523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417799.622758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417799.747813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417799.869520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417800.004513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417800.138625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417800.281240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417800.412996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417800.553213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417800.679628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417800.808708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417800.933083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417801.068993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417801.195888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417801.322881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417801.449198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417801.580242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417801.720527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417801.861996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417801.985342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417802.112840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417802.246911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417802.368045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417802.489346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417802.621074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417802.740284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417802.876532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417802.998461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417803.127867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417803.289738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417803.416894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417803.539729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417803.696996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417803.808896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417803.938083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417804.064727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417804.197666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417804.316840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417804.443757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417804.583426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417804.724517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417804.832147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417804.977087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417805.112875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417805.248637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417805.368768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417805.498761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417805.620000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417805.746777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417805.875239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417805.999210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417806.121091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417806.255052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417806.378448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417806.512661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417806.642884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417806.767381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417806.916285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417807.054563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417807.177480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417807.323377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417807.433524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417807.567241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417807.689538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417807.824519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417807.952710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417808.090780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417808.224456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417808.363806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417808.489470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417808.615536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417808.733495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417808.868889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417808.992531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417809.138084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417809.247465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417809.379528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417809.504493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417809.634458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417809.765537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417809.905857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417810.035701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417810.170066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417810.289887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417810.431713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417810.540339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417810.678139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417810.798584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417810.935758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417811.055499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417811.183055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417811.304198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417811.432855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417811.573604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417811.687584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417811.828434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417811.969079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417812.116555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417812.241829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417812.376959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417812.499862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417812.621833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417812.750948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417812.879836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417813.017062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417813.142598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417813.269988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417813.412019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417813.537373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417813.668934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417813.804580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417813.944173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417814.057355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417814.182536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417814.308873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417814.437946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417814.563745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417814.690092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417814.816693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417814.937640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417815.094077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417815.314961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417815.481490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417815.619992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417815.740780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417815.872435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417816.003363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417816.145604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417816.259302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417816.389362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417816.535600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417816.674553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417816.810986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417816.937830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417817.056254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417817.180011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417817.323103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417817.445844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417817.576722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417817.709826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417817.852627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417817.990456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417818.114716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417818.245832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417818.365074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417818.490779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417818.619762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417818.763715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417818.875057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417819.002668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417819.137583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417819.278102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417819.417765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417819.559311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417819.684668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417819.809004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417819.952389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417820.101872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417820.224157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417820.360196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417820.490474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417820.622043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417820.743233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417820.874970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417821.012481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417821.135259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417821.268908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417821.413876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417821.543736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417821.685458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417821.813762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417821.976780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417822.097815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417822.234917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417822.383652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417822.516658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417822.639775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417822.756514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417822.888572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417823.019802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417823.145049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417823.300448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417823.420867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417823.567761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417823.680024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417823.808664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417823.941300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417824.075669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417824.202103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417824.327863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417824.470402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417824.605758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417824.737840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417824.877267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417824.998929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417825.120551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417825.255743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417825.369725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417825.498429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417825.631079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417825.750168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417825.885034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417826.009515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417826.149003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417826.276531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417826.404580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417826.545102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417826.683825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417826.802635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417826.932965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417827.053178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417827.187319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417827.306654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417827.438099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417827.576813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417827.706673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417827.832566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417828.002042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417828.124491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417828.257181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417828.380407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417828.526667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417828.641530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417828.786186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417828.908689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417829.044633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417829.170841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417829.307474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417829.435373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417829.565514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417829.687351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417829.823516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417829.953272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417830.097821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417830.224789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417830.358663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417830.485965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417830.623132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417830.740622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417830.864864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417831.000075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417831.127123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417831.252963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417831.392378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417831.513593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417831.657804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417831.794643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417831.933354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417832.054172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417832.187804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417832.313339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417832.448946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417832.580662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417832.718094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417832.846609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417833.003669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417833.126884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417833.247453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417833.374021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417833.510921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417833.627617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417833.761187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417833.886658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417834.034405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417834.162253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417834.297760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417834.430795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417834.573817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417834.683401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417834.808077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417834.935753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417835.065910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417835.190793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417835.322299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417835.442005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417835.565307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417835.696906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417835.832802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417835.998476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417836.127560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417836.249166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417836.409299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417836.537634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417836.674824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417836.804034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417836.927155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417837.047345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417837.182828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417837.306820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417837.430651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417837.574280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417837.691425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417837.813895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417837.957874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417838.066660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417838.212085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417838.332139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417838.480600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417838.613622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417838.743794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417838.864246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417838.995889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417839.120874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417839.251366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417839.375091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417839.513327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417839.636055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417839.762904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417839.884893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417840.014740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417840.152394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417840.299037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417840.433049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417840.566354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417840.685133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417840.824871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417840.952288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417841.087941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417841.198173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417841.339081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417841.488134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417841.616866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417841.751631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417841.888557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417842.002295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417842.144552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417842.260210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417842.400119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417842.531910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417842.683390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417842.801368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417842.929916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417843.078463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417843.197455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417843.325236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417843.467279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417843.595286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417843.721588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417843.864120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417844.011163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417844.120646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417844.250238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417844.375083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417844.500837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417844.627052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417844.766144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417844.893632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417845.038241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417845.182073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417845.301623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417845.423938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417845.564322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417845.681919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417845.812852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417845.937201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417846.066108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417846.198989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417846.334291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417846.451429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417846.611889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417846.740136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417846.868334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417846.994240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417847.121204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417847.247571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417847.373327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417847.493905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417847.626127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417847.745548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417847.877483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417848.017916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417848.133777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417848.261801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417848.387692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417848.515629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417848.644792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417848.774970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417848.927953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417849.072794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417849.187496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417849.310777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417849.447430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417849.570263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417849.725861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417849.844213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417849.972437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417850.110050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417850.232300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417850.357886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417850.491727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417850.605548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417850.744931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417850.878923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417851.006644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417851.134193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417851.279188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417851.387480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417851.523421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417851.672307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417851.806413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417851.932071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417852.081834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417852.219379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417852.346707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417852.488353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417852.627358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417852.761669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417852.889068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417853.011001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417853.134973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417853.275729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417853.395310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417853.532351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417853.666647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417853.795480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417853.930322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417854.054095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417854.186052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417854.302675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417854.430840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417854.561199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417854.706680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417854.821055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417854.977878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417855.162992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417855.292352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417855.414869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417855.551496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417855.670585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417855.806503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417855.928162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417856.053666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417856.178707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417856.308681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417856.434219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417856.561720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417856.704488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417856.820113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417856.954194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417857.087897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417857.219559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417857.360678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417857.488111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417857.613843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417857.745716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417857.874625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417858.000227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417858.148226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417858.271514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417858.397498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417858.533790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417858.655934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417858.792327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417858.928902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417859.056767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417859.186061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417859.305515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417859.444202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417859.561493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417859.691040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417859.818667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417859.948051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417860.080286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417860.225972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417860.346326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417860.480255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417860.605701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417860.745065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417860.877296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417860.988809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417861.115487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417861.261478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417861.370890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417861.494518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417861.622810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417861.751793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417861.875658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417862.008620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417862.129667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417862.278750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417862.389004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417862.531215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417862.661369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417862.789258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417862.925069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417863.055305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417863.190838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417863.310321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417863.435619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417863.578161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417863.698898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417863.845527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417863.964516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417864.119271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417864.237686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417864.372413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417864.491288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417864.625622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417864.746064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417864.873301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417864.992632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417865.124881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417865.245283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417865.377491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417865.506974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417865.636592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417865.763792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417865.911295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417866.068189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417866.185697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417866.313654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417866.448295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417866.581515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417866.723259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417866.854514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417866.993446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417867.131064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417867.240924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417867.363612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417867.496422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417867.617467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417867.755297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417867.902370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417868.031133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417868.168885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417868.299719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417868.413838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417868.548678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417868.669661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417868.815311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417868.929665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417869.056560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417869.190495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417869.320828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417869.441182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417869.579458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417869.718767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417869.845785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417870.005884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417870.120996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417870.243258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417870.371955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417870.493113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417870.614053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417870.766235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417870.891829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417871.008016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417871.136288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417871.282071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417871.412882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417871.544970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417871.681638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417871.797588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417871.931802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417872.061288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417872.195089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417872.309931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417872.436733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417872.576658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417872.697208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417872.823891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417872.947417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417873.082398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417873.222640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417873.348811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417873.486041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417873.606655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417873.746218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417873.865701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417873.995654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417874.117898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417874.250578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417874.372296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417874.506699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417874.627570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417874.750737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417874.880574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417875.013728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417875.150769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417875.291243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417875.420279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417875.545856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417875.669111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417875.794952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417875.917192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417876.048877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417876.181669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417876.322230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417876.454972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417876.596372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417876.732825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417876.860303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417876.988365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417877.116601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417877.239644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417877.370613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417877.492425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417877.623824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417877.741315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417877.876961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417878.004123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417878.133838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417878.268547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417878.408330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417878.535472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417878.668745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417878.801618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417878.935095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417879.059001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417879.183323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417879.302712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417879.450982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417879.555577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417879.681191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417879.809348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417879.955061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417880.074329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417880.222085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417880.354397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417880.486509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417880.611523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417880.745953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417880.867530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417881.007487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417881.123532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417881.250666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417881.384049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417881.512508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417881.655864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417881.785324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417881.921660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417882.063170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417882.197741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417882.316579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417882.462382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417882.575922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417882.715439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417882.855667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417882.986273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417883.116327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417883.234898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417883.363797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417883.489140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417883.615421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417883.743155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417883.882542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417884.011504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417884.154364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417884.286300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417884.433410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417884.559298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417884.683733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417884.801122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417884.948392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417885.059517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417885.191664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417885.310672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417885.440619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417885.574414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417885.712523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417885.839409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417885.991061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417886.121297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417886.253599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417886.373068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417886.533143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417886.710995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417886.847267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417886.977979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417887.111532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417887.240575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417887.372833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417887.484755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417887.614292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417887.741782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417887.869413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417888.016036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417888.138135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417888.275889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417888.411340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417888.544998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417888.688502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417888.796390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417888.927573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417889.055093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417889.187514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417889.306679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417889.449554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417889.555551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417889.678468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417889.806747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417889.936235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417890.064691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417890.196271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417890.314592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417890.441535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417890.571008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417890.704226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417890.840441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417890.970559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417891.104908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417891.234272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417891.351633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417891.489172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417891.618656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417891.744804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417891.865447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417891.999350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417892.126869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417892.259507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417892.388503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417892.525190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417892.652321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417892.787422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417892.932099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417893.055852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417893.182071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417893.309093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417893.437307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417893.569510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417893.705016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417893.842583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417893.977661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417894.115423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417894.250900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417894.376002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417894.499120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417894.627715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417894.749845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417894.904742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417895.022644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417895.154988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417895.282550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417895.418195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417895.541805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417895.679457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417895.821684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417895.969956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417896.105128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417896.243629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417896.366928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417896.493661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417896.633021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417896.750257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417896.871264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417896.999511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417897.125021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417897.254557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417897.390666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417897.511501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417897.654496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417897.789550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417897.916537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417898.044436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417898.176125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417898.298810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417898.420799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417898.555661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417898.679607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417898.806821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417898.932158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417899.058671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417899.190010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417899.324338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417899.451025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417899.606369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417899.727715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417899.863659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417899.991567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417900.132796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417900.248654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417900.379799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417900.510489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417900.647952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417900.782281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417900.907983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417901.047621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417901.189320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417901.300447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417901.429360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417901.562443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417901.691792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417901.826470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417901.978887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417902.098982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417902.241369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417902.362669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417902.506990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417902.613882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417902.746578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417902.869754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417902.992056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417903.121826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417903.262142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417903.386342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417903.529516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417903.666292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417903.794920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417903.922385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417904.056386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417904.187631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417904.307218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417904.430665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417904.558080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417904.676277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417904.803718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417904.926799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417905.058214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417905.190073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417905.315627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417905.463372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417905.588874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417905.720648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417905.854618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417905.987003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417906.116080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417906.244382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417906.371265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417906.494666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417906.624865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417906.758533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417906.898020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417907.008281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417907.140706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417907.280331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417907.420743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417907.549526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417907.675448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417907.799159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417907.930964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417908.045113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417908.179909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417908.304862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417908.430771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417908.554619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417908.688760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417908.810019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417908.942015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417909.072381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417909.217364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417909.347895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417909.513655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417909.615752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417909.744391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417909.886748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417910.005810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417910.127750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417910.268555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417910.391100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417910.518483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417910.655765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417910.792287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417910.918587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417911.062495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417911.180553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417911.311056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417911.427603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417911.563725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417911.682174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417911.823169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417911.989174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417912.106977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417912.236690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417912.363437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417912.492927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417912.614714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417912.741084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417912.869588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417912.997467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417913.126898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417913.256881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417913.394838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417913.513496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417913.650586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417913.780942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417913.917865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417914.050555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417914.177613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417914.304866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417914.432713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417914.562978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417914.678619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417914.803506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417914.928688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417915.060818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417915.181468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417915.301895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417915.436822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417915.556223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417915.685494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417915.821592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417915.964457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417916.097241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417916.221170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417916.339129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417916.483577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417916.606602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417916.760351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417916.857779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417916.981858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417917.124330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417917.250798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417917.378264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417917.509567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417917.639575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417917.771660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417917.906267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417918.031193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417918.162491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417918.297276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417918.418103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417918.551766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417918.676376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417918.802579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417918.932951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417919.057677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417919.185315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417919.316367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417919.438353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417919.570267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417919.704063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417919.829682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417919.975554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417920.113726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417920.238586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417920.365713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417920.489258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417920.619119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417920.739754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417920.871605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417921.022161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417921.131025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417921.258264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417921.392160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417921.519608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417921.656444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417921.787653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417921.930480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417922.048103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417922.177779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417922.310827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417922.430212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417922.552674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417922.684049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417922.802966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417922.930493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417923.053868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417923.198217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417923.303993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417923.441431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417923.552776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417923.674762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417923.808783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417923.935778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417924.070319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417924.207342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417924.346330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417924.475964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417924.600731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417924.729201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417924.878271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417924.994389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417925.115544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417925.258861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417925.365020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417925.500570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417925.623564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417925.759430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417925.894325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417926.044228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417926.172544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417926.307470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417926.422282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417926.557189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417926.675704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417926.794878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417926.920439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417927.051022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417927.178583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417927.306276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417927.429558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417927.559674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417927.676449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417927.807108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417927.937691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417928.075717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417928.216546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417928.358864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417928.478141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417928.613939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417928.740191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417928.869494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417928.999911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417929.126367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417929.255120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417929.380832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417929.510800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417929.634005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417929.772530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417929.909363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417930.051510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417930.183545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417930.319845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417930.431167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417930.557873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417930.686963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417930.813173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417930.945503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417931.077217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417931.207026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417931.337354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417931.481420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417931.622197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417931.737870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417931.871973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417932.016416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417932.132171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417932.267060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417932.398583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417932.538650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417932.686153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417932.793821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417932.916444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417933.051505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417933.177602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417933.317689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417933.435600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417933.584868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417933.700422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417933.827937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417933.957017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417934.095143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417934.228107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417934.381699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417934.662620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417934.996381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417935.325840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417935.679412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417936.019650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417936.512563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417936.851238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417937.108530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417937.312754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417937.507825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417937.702590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417937.900143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417938.081191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417938.233255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417938.408124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417938.593753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417938.782652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417938.944266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417939.084394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417939.265697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417939.447851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417939.616863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417939.789524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417939.973678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417940.137898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417940.344221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417940.469513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417940.628130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417940.822293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417940.990434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417941.181813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417941.315545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417941.489461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417941.670032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417941.866626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417942.065566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417942.260101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417942.430397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417942.596890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417942.743895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417942.917506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417943.123886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417943.370626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417943.550886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417943.696104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417943.871965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417944.015128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417944.185301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417944.361735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417944.534187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417944.721261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417944.870114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417945.064764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417945.374498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417945.609632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417945.801024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417945.922565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417946.062405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417946.200908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417946.344417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417946.481863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417946.646339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417946.847988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417947.009159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417947.153926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417947.365165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417947.553716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417947.697816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417947.866663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417948.015984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417948.175557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417948.368051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417948.526414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417948.696538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417948.870915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417949.027905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417949.199619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417949.405351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417949.570938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417949.700059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417949.885450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417950.057549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417950.219583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417950.396402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417950.592001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417950.756078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417950.915201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417951.079495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417951.266859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417951.483782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417951.934908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417952.096526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417952.349898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417952.522216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417952.643689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417952.779127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417952.910412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417953.036313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417953.178856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417953.302102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417953.427323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417953.563939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417953.698482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417953.823666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417953.952075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417954.087945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417954.222638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417954.348434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417954.492494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417954.620856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417954.850600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417954.971102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417955.110682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417955.231804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417955.363476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417955.491665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417955.642996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417955.756115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417955.894743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417956.025144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417956.157938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417956.287256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417956.425903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417956.549021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417956.682225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417956.803735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417956.930293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417957.058521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417957.209622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417957.317778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417957.446624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417957.590645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417957.720032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417957.849163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417957.982668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417958.099830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417958.234055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417958.362169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417958.479386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417958.606580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417958.754691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417958.866210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417958.985414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417959.116992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417959.250146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417959.372512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417959.514688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417959.659080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417959.783525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417959.934012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417960.075074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417960.200521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417960.324358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417960.478365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417960.599575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417960.738888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417960.875801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417960.994026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417961.115391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417961.250602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417961.374149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417961.504880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417961.642042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417961.776421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417961.911908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417962.042583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417962.180878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417962.300412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417962.432631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417962.552785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417962.681762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417962.811138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417962.948701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417963.074204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417963.231992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417963.355528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417963.485162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417963.608609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417963.742528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417963.862246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417963.990220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417964.111953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417964.244179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417964.369621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417964.495746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417964.622896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417964.759871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417964.902046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417965.051378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417965.169926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417965.295289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417965.424775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417965.559136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417965.676502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417965.823055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417965.937964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417966.068240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417966.199518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417966.335722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417966.459915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417966.598475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417966.733543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417966.861009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417967.003815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417967.123564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417967.271928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417967.400276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417967.535657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417967.681570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417967.803465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417967.929497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417968.056342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417968.185436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417968.312692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417968.441781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417968.576330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417968.712042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417968.836438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417968.968074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417969.102748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417969.241784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417969.359911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417969.492713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417969.622736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417969.755807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417969.880996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417970.019453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417970.146897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417970.272792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417970.413051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417970.528222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417970.655258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417970.791934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417970.928052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417971.051212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417971.178583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417971.336666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417971.465635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417971.592066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417971.720654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417971.850585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417971.985835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417972.111670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417972.228534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417972.375342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417972.485871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417972.618911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417972.735054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417972.882535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417973.000902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417973.113691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417973.248541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417973.386589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417973.493543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417973.621883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417973.749102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417973.902734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417974.029911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417974.170933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417974.291688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417974.428439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417974.555329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417974.696019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417974.806948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417974.942275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417975.054766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417975.188204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417975.309844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417975.463393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417975.573647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417975.720630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417975.845083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417975.969163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417976.097419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417976.218635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417976.347353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417976.471568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417976.610604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417976.738754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417976.860753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417976.991476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417977.120088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417977.247420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417977.371126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417977.539818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417977.718842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417977.847950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417977.973047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417978.110078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417978.230867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417978.362201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417978.487675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417978.619404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417978.760423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417978.870662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417978.998019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417979.145509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417979.257589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417979.390144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417979.527014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417979.654844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417979.784380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417979.919729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417980.048590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417980.174738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417980.311447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417980.431243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417980.552513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417980.683650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417980.818516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417980.942409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417981.076448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417981.230680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417981.344592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417981.469949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417981.604799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417981.735013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417981.862230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417981.986419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417982.112748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417982.242757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417982.365597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417982.487453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417982.615181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417982.741778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417982.869741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417983.027887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417983.125783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417983.258849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417983.386711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417983.551039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417983.678560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417983.814004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417983.946017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417984.066504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417984.190506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417984.321175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417984.455116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417984.587935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417984.716333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417984.864835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417984.977539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417985.110733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417985.228624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417985.353025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417985.481986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417985.612714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417985.737430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417985.863726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417985.991898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417986.121947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417986.244875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417986.371139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417986.506581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417986.647154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417986.779468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417986.906233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417987.046370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417987.180207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417987.302572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417987.427115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417987.554632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417987.695478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417987.808443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417987.944215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417988.074923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417988.213126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417988.331196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417988.486429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417988.610379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417988.738811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417988.868020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417988.992258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417989.112833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417989.256418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417989.372913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417989.499272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417989.622025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417989.757305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417989.879074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417990.006599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417990.156222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417990.281048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417990.417665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417990.549925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417990.669589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417990.800941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417990.925916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417991.054954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417991.180644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417991.321693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417991.437583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417991.574644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417991.702389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417991.848524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417991.994558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417992.124910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417992.257100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417992.380054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417992.502377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417992.652640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417992.772355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417992.916186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417993.042730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417993.176290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417993.295940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417993.425960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417993.545710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417993.673930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417993.800513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417993.925762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417994.055046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417994.178416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417994.305188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417994.436773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417994.560050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417994.712667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417994.822839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417994.971365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417995.098909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417995.253511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417995.495040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417995.632468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417995.772361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417995.908174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417996.045725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417996.176260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417996.301246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417996.426580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417996.562823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417996.699636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417996.822470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417996.959372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417997.094537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417997.224206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417997.363755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417997.494225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638417997.623892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417997.746609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417997.884569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417998.027412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417998.158694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417998.314014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417998.426546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417998.571948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417998.682303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417998.808911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417998.941592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417999.061205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417999.192562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417999.321325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417999.456841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417999.589210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417999.729545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638417999.856467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418000.003651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418000.128246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418000.259654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418000.407022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418000.528377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418000.654219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418000.789285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418000.921793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418001.058773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418001.204297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418001.316462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418001.445729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418001.589433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418001.737064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418001.869929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418002.022509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418002.147387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418002.295763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418002.429021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418002.550143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418002.679351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418002.801950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418002.946148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418003.068202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418003.195387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418003.341988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418003.470121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418003.603063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418003.731801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418003.862463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418003.998092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418004.126714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418004.257637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418004.387938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418004.513220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418004.655270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418004.791851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418004.926418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418005.053506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418005.173353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418005.296994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418005.423270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418005.562208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418005.683113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418005.811633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418005.943345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418006.072546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418006.212525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418006.359854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418006.481634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418006.614355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418006.746359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418006.866189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418006.999878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418007.126369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418007.278742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418007.426208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418007.529644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418007.675548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418007.805042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418007.929875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418008.071465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418008.201327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418008.321639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418008.464453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418008.597430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418008.731728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418008.863497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418008.987222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418009.113039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418009.239039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418009.363783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418009.496029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418009.634969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418009.745222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418009.889049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418010.028754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418010.161212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418010.285720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418010.419565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418010.550077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418010.671414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418010.800018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418010.924512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418011.047181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418011.181042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418011.317990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418011.442588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418011.587322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418011.719378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418011.851357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418011.989746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418012.141290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418012.241505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418012.367124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418012.498042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418012.628951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418012.754819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418012.894470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418013.014293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418013.161866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418013.299011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418013.426686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418013.556722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418013.685554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418013.834705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418013.947947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418014.094461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418014.224908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418014.346467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418014.477597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418014.611772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418014.732665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418014.857883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418014.988925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418015.130457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418015.244416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418015.380589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418015.509027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418015.632804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418015.777350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418015.944457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418016.057470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418016.179088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418016.315240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418016.444199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418016.570735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418016.710481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418016.854300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418016.975457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418017.103896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418017.236437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418017.363065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418017.484333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418017.617052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418017.736394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418017.867870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418017.988814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418018.114479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418018.245060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418018.369907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418018.500537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418018.629113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418018.759828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418018.900895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418019.030951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418019.162150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418019.297828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418019.426795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418019.552513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418019.678994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418019.806842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418019.933003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418020.057516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418020.183387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418020.306409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418020.454047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418020.578358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418020.715906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418020.840065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418021.006737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418021.112691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418021.235288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418021.372008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418021.520943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418021.639951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418021.777158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418021.909240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418022.038911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418022.172038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418022.302985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418022.429530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418022.571426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418022.697365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418022.838992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418022.969432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418023.101462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418023.231510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418023.361732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418023.490501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418023.618037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418023.748996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418023.881490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418024.005975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418024.155403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418024.276155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418024.421919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418024.548424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418024.680932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418024.805527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418024.929267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418025.058032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418025.184783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418025.318087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418025.466843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418025.584871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418025.744962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418025.851634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418025.987288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418026.111979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418026.256767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418026.370917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418026.518661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418026.638309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418026.791882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418026.920663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418027.055390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418027.177817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418027.311292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418027.430845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418027.566518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418027.683431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418027.818440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418027.948687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418028.094068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418028.221594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418028.356079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418028.481453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418028.617476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418028.743429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418028.883610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418029.015198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418029.155218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418029.282763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418029.432083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418029.565460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418029.682750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418029.804960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418029.964435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418030.078962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418030.214506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418030.338475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418030.467573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418030.595062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418030.722504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418030.857466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418030.991447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418031.106735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418031.242546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418031.369179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418031.510412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418031.626917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418031.774862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418031.916492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418032.058303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418032.181318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418032.335868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418032.452189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418032.606501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418032.722541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418032.861862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418032.976900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418033.111436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418033.228480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418033.364770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418033.487314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418033.622589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418033.752323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418033.878308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418033.994408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418034.128793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418034.258239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418034.403941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418034.538887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418034.674058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418034.798968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418034.989230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418035.153468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418035.295685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418035.414912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418035.546827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418035.679734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418035.803695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418035.928258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418036.065586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418036.192070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418036.339852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418036.465085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418036.610768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418036.732659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418036.861334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418036.987483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418037.118623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418037.242750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418037.381907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418037.510936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418037.657096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418037.781523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418037.915259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418038.043940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418038.179225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418038.308732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418038.444628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418038.568127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418038.687102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418038.815353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418038.945310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418039.078306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418039.227258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418039.351744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418039.483571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418039.608117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418039.741501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418039.880914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418039.998668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418040.133222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418040.261916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418040.403900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418040.547687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418040.667478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418040.794153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418040.919153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418041.052380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418041.191036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418041.299884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418041.433302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418041.583800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418041.694366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418041.844476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418041.964816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418042.094029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418042.229809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418042.362362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418042.512824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418042.631276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418042.764860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418042.903035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418043.034744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418043.168983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418043.291203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418043.419544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418043.549958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418043.671765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418043.808681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418043.944030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418044.053619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418044.182020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418044.306620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418044.437053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418044.567661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418044.695901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418044.837783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418044.980778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418045.128579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418045.255764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418045.360863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418045.491879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418045.621469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418045.759234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418045.877860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418046.018755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418046.152754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418046.290469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418046.412539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418046.543506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418046.670275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418046.807127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418046.935776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418047.065983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418047.196737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418047.317181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418047.444803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418047.611208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418047.735451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418047.865955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418047.993657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418048.116074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418048.239459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418048.366668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418048.496355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418048.624092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418048.746346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418048.898299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418049.012237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418049.136715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418049.284423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418049.415385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418049.537733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418049.684055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418049.804307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418049.929031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418050.055212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418050.180938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418050.321898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418050.441611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418050.563605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418050.693426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418050.828569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418050.971848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418051.094590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418051.230686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418051.351837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418051.491701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418051.610933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418051.745250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418051.870027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418052.004087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418052.144938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418052.268866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418052.405672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418052.546825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418052.682375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418052.814931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418052.923149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418053.057240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418053.174486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418053.304116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418053.423479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418053.550341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418053.677728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418053.808341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418053.943049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418054.054793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418054.179828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418054.313575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418054.431262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418054.567102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418054.713865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418054.840310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418054.970877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418055.121020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418055.237053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418055.358207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418055.493991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418055.621325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418055.774812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418055.898487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418056.036400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418056.168493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418056.291449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418056.425112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418056.565294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418056.675641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418056.796372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418056.927742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418057.051967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418057.199106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418057.308317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418057.437286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418057.569542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418057.700806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418057.844249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418057.989610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418058.108981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418058.239656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418058.377693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418058.495903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418058.625078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418058.757281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418058.894180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418059.029063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418059.156909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418059.295983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418059.422371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418059.567839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418059.677803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418059.804848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418059.942710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418060.081457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418060.224950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418060.371843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418060.484516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418060.614217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418060.744956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418060.879910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418061.016534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418061.153732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418061.299957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418061.423934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418061.540701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418061.674714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418061.794116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418061.933937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418062.097767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418062.235183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418062.370753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418062.493168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418062.606073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418062.743701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418062.867855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418062.991784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418063.120018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418063.251387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418063.401317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418063.523962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418063.664295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418063.790602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418063.916299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418064.060005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418064.178204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418064.306774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418064.449216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418064.588832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418064.700691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418064.830630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418064.967861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418065.103675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418065.221435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418065.352918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418065.482685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418065.611644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418065.733443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418065.867564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418065.989546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418066.120848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418066.238528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418066.366736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418066.505028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418066.631703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418066.764181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418066.913319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418067.034178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418067.165994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418067.295364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418067.420079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418067.548825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418067.674765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418067.803298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418067.949950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418068.069291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418068.198934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418068.334614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418068.482747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418068.625760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418068.748443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418068.878253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418069.011829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418069.139499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418069.264374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418069.403055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418069.546515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418069.674567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418069.802048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418069.930052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418070.065521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418070.190645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418070.323508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418070.448812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418070.592980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418070.722143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418070.852482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418070.980850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418071.127255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418071.237899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418071.378205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418071.499060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418071.630755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418071.774362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418071.910561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418072.043269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418072.176258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418072.298620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418072.429651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418072.551828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418072.681136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418072.807772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418072.928798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418073.059034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418073.184937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418073.315401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418073.456171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418073.586756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418073.736060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418073.850750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418073.987455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418074.110986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418074.239170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418074.365983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418074.490810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418074.618576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418074.753829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418074.892569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418075.017993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418075.146344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418075.264460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418075.413676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418075.547849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418075.680151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418075.806526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418075.928642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418076.071009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418076.198675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418076.345979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418076.466235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418076.616461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418076.727201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418076.847412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418077.090065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418077.219632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418077.371055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418077.486392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418077.617144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418077.743788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418077.870881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418077.995085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418078.124399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418078.258587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418078.388201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418078.535310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418078.652165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418078.781643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418078.920192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418079.037845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418079.182427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418079.288160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418079.441686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418079.553767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418079.679623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418079.800166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418079.939044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418080.087934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418080.200748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418080.346047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418080.483845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418080.602079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418080.732573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418080.858120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418080.988492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418081.129251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418081.253419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418081.381315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418081.513216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418081.652882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418081.798437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418081.917808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418082.055717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418082.185332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418082.315648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418082.433297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418082.565266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418082.689726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418082.810924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418082.936725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418083.069822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418083.193936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418083.343619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418083.491304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418083.614184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418083.738482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418083.863782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418083.985156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418084.115381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418084.247239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418084.380961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418084.505278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418084.651444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418084.780714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418084.905977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418085.033489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418085.176964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418085.296121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418085.420886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418085.551473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418085.704613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418085.801718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418085.941677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418086.067265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418086.207124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418086.367643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418086.609235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418086.755145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418086.900126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418087.031710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418087.179515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418087.302106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418087.443655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418087.545997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418087.678438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418087.809724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418087.948010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418088.075793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418088.212577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418088.340154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418088.481555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418088.616255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418088.735073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418088.859453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418088.988228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418089.115154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418089.247200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418089.380325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418089.497514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418089.622757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418089.759912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418089.905192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418090.054035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418090.158120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418090.291888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418090.412611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418090.550794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418090.670780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418090.799340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418090.925371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418091.066465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418091.203102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418091.338052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418091.465939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418091.601342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418091.727437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418091.871832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418092.024445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418092.153066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418092.282399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418092.428910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418092.551922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418092.677189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418092.799948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418092.925206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418093.053802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418093.190655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418093.319649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418093.450011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418093.591500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418093.735650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418093.857276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418093.986061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418094.112338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418094.243443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418094.370423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418094.507370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418094.628129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418094.779061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418094.899709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418095.026148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418095.161370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418095.302767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418095.423007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418095.552581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418095.672635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418095.800385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418095.926619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418096.055436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418096.181611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418096.318324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418096.440615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418096.590971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418096.749903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418096.916646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418097.025694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418097.154670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418097.279299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418097.407985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418097.542480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418097.674724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418097.812739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418097.927693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418098.058796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418098.214655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418098.343630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418098.490923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418098.612998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418098.756110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418098.864526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418099.022628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418099.128067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418099.253772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418099.389191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418099.523905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418099.648873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418099.790741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418099.913374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418100.045760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418100.172215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418100.305501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418100.442253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418100.570725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418100.696949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418100.830230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418100.966472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418101.101836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418101.229320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418101.356405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418101.486170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418101.617339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418101.741475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418101.869065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418101.991425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418102.129347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418102.256855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418102.419641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418102.542271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418102.674185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418102.793647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418102.938512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418103.037603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418103.193933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418103.303728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418103.438707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418103.565495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418103.700134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418103.844601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418103.980985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418104.108808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418104.229970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418104.360744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418104.504993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418104.616869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418104.756416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418104.906864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418105.035310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418105.157063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418105.280959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418105.420073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418105.549330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418105.684335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418105.805312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418105.930968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418106.057351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418106.191305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418106.318137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418106.449301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418106.606155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418106.728168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418106.862578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418106.990434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418107.126732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418107.258651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418107.401260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418107.539079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418107.677222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418107.791424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418107.926638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418108.050077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418108.189718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418108.299384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418108.441879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418108.557525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418108.692898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418108.838840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418108.980128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418109.097837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418109.240145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418109.350063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418109.480736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418109.606308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418109.737733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418109.865567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418109.992600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418110.126410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418110.244521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418110.367236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418110.501723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418110.622527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418110.767406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418110.897337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418111.031962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418111.159680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418111.291257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418111.424260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418111.563941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418111.670810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418111.796602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418111.922973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418112.070884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418112.180081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418112.305570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418112.431388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418112.564029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418112.698789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418112.842010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418112.976056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418113.108287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418113.239770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418113.365834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418113.496201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418113.632746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418113.741410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418113.871988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418113.989952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418114.118488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418114.244914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418114.378841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418114.500320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418114.631611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418114.758354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418114.906296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418115.040944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418115.179999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418115.461443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418115.778095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418116.055339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418116.379494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418116.824675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418117.101056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418117.442925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418117.738505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418118.035592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418118.272749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418118.467212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418118.654413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418118.871229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418119.088790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418119.279091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418119.457242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418119.659769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418119.819586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418120.001490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418120.181985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418120.400148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418120.553693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418120.687292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418120.875187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418121.043486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418121.215026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418121.384761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418121.560205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418121.743524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418121.883375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418122.117603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418122.273106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418122.461993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418122.619703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418122.815360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418122.984887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418123.154221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418123.303525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418123.490411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418123.678886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418123.816284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418124.005362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418124.171550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418124.401426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418124.628059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418124.815315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418124.979834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418125.164729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418125.332633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418125.483118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418125.648032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418125.808613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418126.003277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418126.142147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418126.344125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418126.687931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418126.955396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418127.114495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418127.244431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418127.377184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418127.530104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418127.688658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418127.835421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418128.010942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418128.190034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418128.370396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418128.543380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418128.697175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418128.885808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418129.067643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418129.245796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418129.422524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418129.595291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418129.767778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418129.939421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418130.087676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418130.317060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418130.465174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418130.626977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418130.807116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418130.971700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418131.151117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418131.358124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418131.489446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418131.668520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418131.842466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418132.027279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418132.189626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418132.388386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418132.568584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418132.766071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418133.077408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418133.399539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418133.614540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418133.857600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418133.981756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418134.128943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418134.252921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418134.370446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418134.507363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418134.627770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418134.765070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418134.914421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418135.045975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418135.171315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418135.308556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418135.426306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418135.548524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418135.680827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418135.817122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418136.063767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418136.185165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418136.314631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418136.447672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418136.584624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418136.750765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418136.857631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418136.973889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418137.126806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418137.232023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418137.366767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418137.493338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418137.628119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418137.760358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418137.906509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418138.033294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418138.168776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418138.293068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418138.426148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418138.566833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418138.697088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418138.836035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418138.963320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418139.077739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418139.232352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418139.353306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418139.486434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418139.606706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418139.735458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418139.861739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418139.994223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418140.132678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418140.262707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418140.414745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418140.548944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418140.671538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418140.831268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418140.963979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418141.108101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418141.231773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418141.364844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418141.503232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418141.628553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418141.757875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418141.911980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418142.041703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418142.191420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418142.301552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418142.427804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418142.555633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418142.688132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418142.815189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418142.946311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418143.090537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418143.241026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418143.357781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418143.490533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418143.609156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418143.739468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418143.862674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418143.990437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418144.126706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418144.252606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418144.397984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418144.543972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418144.659688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418144.798863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418144.917418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418145.071062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418145.189221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418145.314719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418145.446242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418145.588178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418145.714199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418145.845653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418145.974113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418146.112930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418146.238579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418146.369673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418146.491649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418146.623858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418146.754437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418146.890686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418147.016664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418147.154268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418147.293923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418147.440426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418147.550545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418147.690999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418147.802744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418147.932611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418148.056813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418148.187445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418148.321716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418148.443753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418148.598769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418148.751635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418148.867730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418149.012349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418149.132243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418149.260094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418149.393580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418149.541867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418149.653703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418149.799048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418149.921804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418150.053699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418150.169080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418150.297434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418150.483827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418150.616486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418150.752801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418150.887015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418151.017429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418151.152107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418151.277886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418151.418493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418151.533969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418151.672454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418151.801771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418151.929691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418152.051163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418152.182760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418152.304931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418152.452058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418152.588779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418152.714772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418152.847913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418152.983644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418153.105965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418153.240784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418153.364330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418153.493308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418153.619628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418153.748958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418153.880101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418154.016554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418154.147177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418154.288178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418154.413578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418154.549665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418154.681008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418154.808240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418154.938620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418155.067961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418155.193201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418155.346702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418155.480159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418155.614760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418155.753563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418155.871483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418155.989803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418156.127170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418156.252002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418156.385089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418156.504070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418156.647376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418156.781064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418156.919463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418157.044774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418157.175858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418157.299509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418157.436679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418157.564360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418157.697023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418157.834305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418157.963145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418158.094885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418158.225417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418158.351501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418158.483930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418158.608741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418158.738820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418158.860010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418158.990250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418159.116149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418159.250045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418159.376337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418159.523795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418159.663986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418159.805797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418159.915018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418160.051341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418160.177716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418160.313350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418160.439783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418160.566808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418160.693805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418160.833941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418160.969049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418161.118691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418161.223687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418161.351420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418161.491235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418161.610790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418161.730315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418161.861081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418161.984316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418162.112252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418162.240582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418162.378758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418162.484470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418162.613096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418162.753471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418162.869431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418163.004116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418163.127766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418163.265730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418163.405642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418163.557567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418163.668857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418163.792498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418163.923753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418164.049978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418164.178202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418164.304785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418164.444938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418164.570246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418164.693670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418164.860740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418164.992080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418165.120932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418165.253940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418165.396947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418165.534212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418165.675884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418165.796898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418165.920710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418166.063637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418166.168951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418166.323556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418166.432067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418166.556352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418166.709777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418166.842804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418166.979524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418167.113144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418167.247682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418167.376780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418167.500189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418167.656828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418167.777937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418167.919158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418168.031143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418168.171634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418168.296030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418168.425303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418168.552676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418168.683597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418168.816224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418168.955235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418169.099612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418169.231312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418169.358402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418169.490345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418169.623358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418169.733019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418169.862016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418169.991737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418170.128990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418170.243108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418170.368528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418170.510095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418170.642211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418170.776016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418170.897999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418171.035908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418171.163570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418171.298323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418171.423226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418171.562552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418171.679230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418171.814563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418171.946466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418172.083703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418172.218775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418172.351921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418172.499539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418172.612523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418172.727663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418172.858489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418172.986926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418173.109993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418173.253486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418173.362588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418173.484681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418173.610371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418173.736640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418173.869620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418173.993741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418174.139371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418174.259196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418174.380086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418174.506720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418174.662887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418174.785001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418174.914607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418175.035331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418175.168195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418175.288927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418175.439858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418175.554926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418175.701879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418175.818075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418175.965199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418176.144382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418176.378796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418176.492670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418176.642999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418176.753776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418176.916537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418177.023517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418177.163801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418177.301599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418177.425916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418177.554976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418177.692409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418177.816235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418177.947111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418178.093690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418178.229467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418178.376376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418178.489832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418178.624406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418178.745752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418178.876615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418179.007318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418179.138177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418179.274278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418179.414263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418179.545719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418179.670531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418179.798590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418179.940290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418180.081822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418180.213245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418180.348241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418180.482947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418180.616420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418180.733189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418180.862324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418180.991081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418181.118648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418181.248798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418181.397794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418181.540198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418181.671253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418181.798719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418181.934998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418182.090642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418182.228429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418182.353105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418182.493012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418182.628026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418182.755747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418182.879666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418183.021845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418183.150409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418183.286413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418183.406970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418183.546078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418183.668251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418183.814768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418183.939424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418184.083189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418184.214223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418184.348489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418184.470407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418184.599406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418184.733419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418184.864617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418184.992513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418185.148292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418185.277937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418185.417585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418185.538362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418185.666348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418185.789898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418185.915928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418186.041577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418186.189419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418186.313868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418186.428184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418186.564671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418186.712137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418186.838414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418186.978940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418187.101845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418187.232859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418187.361305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418187.488068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418187.616236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418187.748035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418187.878066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418188.039922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418188.167560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418188.290011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418188.427423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418188.545362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418188.682657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418188.800880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418188.929116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418189.059514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418189.190103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418189.322966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418189.472660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418189.587342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418189.711536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418189.857061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418189.982238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418190.114281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418190.240150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418190.370124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418190.499734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418190.638134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418190.764414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418190.912533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418191.042065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418191.175267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418191.292410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418191.423030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418191.546735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418191.672321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418191.799082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418191.921531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418192.047071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418192.177492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418192.308185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418192.427143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418192.552997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418192.681149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418192.812551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418192.944360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418193.072725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418193.213935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418193.347682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418193.492918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418193.600544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418193.730224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418193.861840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418193.999309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418194.129955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418194.270651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418194.404871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418194.543323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418194.672531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418194.797983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418194.921458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418195.052618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418195.181723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418195.325725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418195.455276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418195.585657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418195.710911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418195.857232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418195.994745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418196.125663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418196.266949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418196.400617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418196.526178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418196.664834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418196.824725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418197.044411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418197.249436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418197.524181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418197.755752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418197.936493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418198.193745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418198.404961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418198.677037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418198.872432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418199.057019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418199.251757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418199.489581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418199.730372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418199.929516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418200.270109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418200.462981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418200.653767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418200.900189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418201.045093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418201.174339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418201.313880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418201.432901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418201.550929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418201.688658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418201.820315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418201.980191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418202.111064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418202.230690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418202.359575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418202.491157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418202.623458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418202.753691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418202.878009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418203.007576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418203.152594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418203.292891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418203.419281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418203.552789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418203.694020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418203.831121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418203.957724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418204.105789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418204.235610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418204.367337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418204.503249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418204.656772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418204.777022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418204.906057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418205.044344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418205.176617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418205.299855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418205.432075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418205.553792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418205.707891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418205.842496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418205.980785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418206.103772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418206.240547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418206.364265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418206.500015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418206.639390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418206.782345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418206.905783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418207.057232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418207.156633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418207.314923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418207.425421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418207.577657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418207.697435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418207.836428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418207.979431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418208.113703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418208.233182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418208.384754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418208.521502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418208.644569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418208.783789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418208.935226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418209.067287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418209.177479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418209.305887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418209.456180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418209.574885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418209.703593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418209.839731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418209.999800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418210.107084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418210.231061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418210.372715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418210.521813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418210.645494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418210.770390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418210.902685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418211.045847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418211.170899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418211.298583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418211.421533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418211.549972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418211.678293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418211.798734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418211.927399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418212.085726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418212.228374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418212.357774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418212.478329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418212.606119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418212.734659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418212.855113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418212.981837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418213.115928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418213.249318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418213.358222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418213.486161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418213.623395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418213.749932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418213.890350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418214.024482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418214.164651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418214.299146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418214.434269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418214.553482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418214.681713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418214.797258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418214.919374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418215.051877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418215.194575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418215.315665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418215.444618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418215.571294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418215.705855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418215.839874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418215.974009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418216.106247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418216.230517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418216.347185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418216.479330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418216.601103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418216.776514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418216.946033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418217.092722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418217.212765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418217.359025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418217.475799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418217.617651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418217.736447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418217.875760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418217.998615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418218.127675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418218.272156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418218.423214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418218.535871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418218.676668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418218.785814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418218.922818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418219.053693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418219.187187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418219.319250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418219.459546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418219.593256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418219.735908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418219.861526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418219.997181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418220.122755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418220.249992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418220.387799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418220.529800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418220.655091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418220.794278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418220.912248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418221.051371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418221.174558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418221.301802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418221.425878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418221.562318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418221.687114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418221.822346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418221.947471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418222.102645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418222.223227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418222.358611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418222.481832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418222.606782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418222.730272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418222.860321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418222.981478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418223.113548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418223.238587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418223.366195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418223.500910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418223.627067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418223.756480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418223.882756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418224.021739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418224.158589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418224.283297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418224.415965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418224.553456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418224.674587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418224.795609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418224.944298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418225.046673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418225.180838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418225.311767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418225.458108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418225.582660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418225.731671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418225.857649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418225.975250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418226.114114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418226.254469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418226.362976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418226.495400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418226.611951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418226.748170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418226.884505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418227.032314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418227.167634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418227.296800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418227.418633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418227.554619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418227.677467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418227.812044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418227.957138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418228.081937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418228.221659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418228.339726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418228.480412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418228.610694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418228.728110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418228.856404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418228.982895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418229.113179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418229.238007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418229.381022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418229.520681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418229.663421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418229.784711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418229.919483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418230.060656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418230.171717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418230.296867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418230.428858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418230.552495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418230.677213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418230.800162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418230.943605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418231.066499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418231.188041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418231.319185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418231.460957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418231.596755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418231.731138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418231.856265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418231.993589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418232.112860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418232.242432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418232.363567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418232.500915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418232.630391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418232.772708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418232.900087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418233.041716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418233.166386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418233.301197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418233.423504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418233.559531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418233.683184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418233.825265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418233.960741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418234.084407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418234.223500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418234.352575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418234.478506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418234.609890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418234.728776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418234.860567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418234.987187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418235.126806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418235.251077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418235.379635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418235.513843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418235.666558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418235.790422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418235.917823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418236.052518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418236.173909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418236.291639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418236.420355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418236.540245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418236.672475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418236.800663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418236.932290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418237.060181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418237.191640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418237.337451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418237.459624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418237.592556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418237.736012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418237.862404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418237.985711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418238.116218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418238.248398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418238.386027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418238.506475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418238.645737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418238.784406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418238.904012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418239.035997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418239.169599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418239.292657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418239.414433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418239.543189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418239.662955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418239.799289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418239.925867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418240.078649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418240.200880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418240.348171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418240.470096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418240.601040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418240.722926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418240.876046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418240.982225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418241.115121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418241.234042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418241.366050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418241.487376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418241.625717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418241.751930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418241.886724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418242.057745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418242.179151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418242.310404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418242.436856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418242.569761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418242.710680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418242.839755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418242.969181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418243.101895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418243.224049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418243.346788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418243.480273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418243.605501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418243.731654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418243.855557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418244.006341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418244.126445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418244.247335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418244.378376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418244.525173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418244.657807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418244.785496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418244.908201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418245.042403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418245.170161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418245.294013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418245.424309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418245.558271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418245.679115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418245.813260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418245.958064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418246.091489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418246.228817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418246.354943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418246.475125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418246.601775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418246.743007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418246.866976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418246.987027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418247.124815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418247.239309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418247.372173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418247.488972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418247.620443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418247.765272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418247.913869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418248.040470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418248.187879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418248.376273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418248.505141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418248.639647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418248.779004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418248.899720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418249.037353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418249.158453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418249.286808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418249.420891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418249.551501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418249.682783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418249.804341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418249.933148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418250.061310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418250.190700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418250.336037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418250.477036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418250.614224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418250.748356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418250.877727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418250.984429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418251.114869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418251.239345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418251.370662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418251.497168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418251.634804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418251.769081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418251.929506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418252.046969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418252.171413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418252.290026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418252.421879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418252.542101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418252.686191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418252.799851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418252.930821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418253.066924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418253.207771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418253.335506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418253.480671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418253.619278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418253.732937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418253.859985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418253.985245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418254.110986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418254.256737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418254.388474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418254.519054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418254.648254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418254.791978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418254.919563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418255.037498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418255.165341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418255.296545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418255.417129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418255.562019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418255.672542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418255.805503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418255.967847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418256.088609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418256.217316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418256.351994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418256.478111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418256.608584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418256.743475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418256.892883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418257.005482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418257.125135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418257.269822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418257.396576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418257.538447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418257.660194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418257.791300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418257.942338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418258.048706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418258.185671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418258.315392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418258.446006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418258.577198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418258.699890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418258.847284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418258.982145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418259.098896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418259.240107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418259.355841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418259.485254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418259.626076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418259.753814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418259.877686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418259.995500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418260.138129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418260.267489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418260.399554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418260.536715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418260.663604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418260.794940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418260.927470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418261.067732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418261.207950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418261.349065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418261.467171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418261.603332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418261.730571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418261.861171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418261.989841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418262.132312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418262.254767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418262.383452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418262.519268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418262.663356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418262.785748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418262.917487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418263.040603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418263.172798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418263.301033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418263.428545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418263.548836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418263.677220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418263.811494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418263.927000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418264.059377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418264.201633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418264.339648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418264.478303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418264.602366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418264.729952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418264.854448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418264.982048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418265.108501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418265.246052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418265.376321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418265.522916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418265.661564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418265.785223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418265.916303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418266.040627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418266.163751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418266.302357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418266.423800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418266.560059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418266.699874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418266.836930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418266.958496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418267.094914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418267.239087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418267.356422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418267.476563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418267.610850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418267.730023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418267.866688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418267.998001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418268.140477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418268.269208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418268.419200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418268.533228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418268.664759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418268.791430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418268.915350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418269.043793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418269.178410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418269.314144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418269.458433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418269.586545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418269.725799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418269.858310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418269.978889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418270.115094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418270.263251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418270.379485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418270.501568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418270.622154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418270.765963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418270.881227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418271.041547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418271.169645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418271.297311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418271.434478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418271.547448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418271.684979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418271.827915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418271.936956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418272.106706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418272.255074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418272.386539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418272.503840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418272.639052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418272.775036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418272.919905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418273.042494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418273.183635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418273.297265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418273.431622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418273.554469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418273.691227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418273.837186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418273.994958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418274.104725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418274.228347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418274.348953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418274.480365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418274.603227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418274.733932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418274.859138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418274.998135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418275.124089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418275.259748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418275.398577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418275.545157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418275.665332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418275.800491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418275.926481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418276.061150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418276.206793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418276.336458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418276.476095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418276.607275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418276.730208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418276.862775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418276.988621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418277.144411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418277.241834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418277.372770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418277.504333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418277.654643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418277.781265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418277.914615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418278.030775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418278.168018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418278.293611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418278.421888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418278.548860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418278.682300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418278.826662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418278.937695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418279.096097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418279.223881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418279.354471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418279.480178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418279.602576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418279.736111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418279.864877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418279.990936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418280.120352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418280.250930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418280.403179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418280.522033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418280.646185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418280.774246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418280.907009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418281.039552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418281.166816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418281.295845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418281.423335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418281.557512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418281.692408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418281.830848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418281.968426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418282.098801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418282.228469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418282.374662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418282.477019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418282.608982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418282.738827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418282.891322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418282.998491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418283.136539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418283.262983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418283.397259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418283.524304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418283.661463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418283.790982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418283.927333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418284.052898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418284.183814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418284.302730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418284.430666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418284.578177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418284.714995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418284.844532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418284.975871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418285.101255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418285.226988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418285.352324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418285.473501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418285.610778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418285.733081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418285.860971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418285.990510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418286.126842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418286.253205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418286.398229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418286.540749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418286.663668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418286.794004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418286.918682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418287.049528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418287.167614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418287.294519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418287.423838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418287.556824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418287.684501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418287.813029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418287.956109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418288.119469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418288.225921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418288.345905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418288.495681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418288.610834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418288.748649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418288.863408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418288.993751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418289.137172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418289.248596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418289.395912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418289.522387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418289.660117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418289.782061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418289.913182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418290.040447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418290.169147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418290.293801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418290.428169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418290.554521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418290.697839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418290.827015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418290.958316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418291.097540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418291.233918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418291.355849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418291.481524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418291.608044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418291.746964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418291.858771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418291.991104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418292.121165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418292.282301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418292.405797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418292.530990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418292.665900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418292.809957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418292.917176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418293.052394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418293.184147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418293.307429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418293.433431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418293.586902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418293.709304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418293.845644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418293.966358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418294.101043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418294.228373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418294.352523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418294.497232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418294.612939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418294.747151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418294.890703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418295.021206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418295.154748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418295.288952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418295.411899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418295.542404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418295.665833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418295.795961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418295.949858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418296.223528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418296.559342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418296.887198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418297.303256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418297.657479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418297.942475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418298.299649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418298.611505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418298.919500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418299.073535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418299.270635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418299.435217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418299.673362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418299.837728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418300.072299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418300.233301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418300.412448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418300.588073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418300.746406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418300.950493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418301.108035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418301.269348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418301.434858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418301.597551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418301.770754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418302.000306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418302.170275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418302.371174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418302.566332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418302.728611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418302.894631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418303.048544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418303.232655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418303.382843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418303.614351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418303.747133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418303.929312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418304.138135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418304.272235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418304.476469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418304.607543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418304.812369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418305.044097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418305.228559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418305.408173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418305.618538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418305.833455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418305.987627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418306.176282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418306.310526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418306.485200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418306.648260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418306.798647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418306.994779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418307.125298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418307.285252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418307.457310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418307.600251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418307.934587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418308.186515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418308.365650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418308.545784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418308.683534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418308.793670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418308.943251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418309.081882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418309.271719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418309.457930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418309.613747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418309.789584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418309.987359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418310.152550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418310.326908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418310.517714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418310.714720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418310.892967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418311.028094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418311.241552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418311.391587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418311.626533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418311.767017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418311.985731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418312.122328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418312.277082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418312.448597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418312.654248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418312.829792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418312.982191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418313.125487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418313.332745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418313.482661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418313.647189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418313.799001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418313.983233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418314.177096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418314.494762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418314.825872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418315.139956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418315.299058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418315.455583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418315.595031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418315.719858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418315.839457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418315.971971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418316.106424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418316.240448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418316.389489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418316.526522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418316.655028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418316.808664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418316.913095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418317.044571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418317.167723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418317.300243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418317.433772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418317.673056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418317.798593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418317.927567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418318.049030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418318.181145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418318.310479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418318.469442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418318.603271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418318.733244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418318.856905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418318.985035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418319.106115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418319.233836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418319.357025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418319.491124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418319.615568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418319.755153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418319.882127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418320.022352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418320.146209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418320.286132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418320.420015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418320.544322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418320.671558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418320.801795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418320.941983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418321.054149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418321.184225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418321.334327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418321.456807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418321.597222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418321.733754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418321.865592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418321.995606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418322.129343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418322.263931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418322.413670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418322.552459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418322.671866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418322.809181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418322.929129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418323.059127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418323.186030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418323.319561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418323.452940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418323.583147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418323.729262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418323.853071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418323.983708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418324.110047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418324.242673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418324.361813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418324.494075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418324.621684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418324.767500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418324.894659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418325.025487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418325.163255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418325.290899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418325.415652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418325.546251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418325.673308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418325.810595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418325.956638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418326.100681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418326.240462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418326.357093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418326.498179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418326.614799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418326.735664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418326.871664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418326.999371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418327.147506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418327.279465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418327.405620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418327.530133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418327.667049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418327.790584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418327.932431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418328.064634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418328.202216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418328.329557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418328.474039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418328.594369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418328.734367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418328.849242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418328.979931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418329.107664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418329.235965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418329.363266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418329.506943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418329.640698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418329.771419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418329.900002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418330.036812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418330.170399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418330.302722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418330.439946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418330.568901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418330.708228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418330.850918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418330.994992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418331.109893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418331.247732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418331.361742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418331.485218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418331.620944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418331.746099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418331.894704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418332.021858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418332.170478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418332.295116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418332.436560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418332.549473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418332.674796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418332.812630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418332.933217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418333.067365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418333.201314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418333.332983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418333.468250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418333.600279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418333.733431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418333.854725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418334.006580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418334.139647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418334.275206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418334.407194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418334.541611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418334.666010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418334.794840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418334.913488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418335.048686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418335.185664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418335.301086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418335.430568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418335.564481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418335.698462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418335.823699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418335.949313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418336.098102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418336.214917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418336.347421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418336.469775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418336.602054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418336.733632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418336.856718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418336.979723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418337.107303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418337.230986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418337.364992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418337.486966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418337.640947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418337.756169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418337.892219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418338.016347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418338.157732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418338.290740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418338.495126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418338.623802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418338.745330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418338.870404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418339.019372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418339.148927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418339.283599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418339.410554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418339.542019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418339.663060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418339.795383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418339.932479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418340.059964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418340.182049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418340.329820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418340.456763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418340.595367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418340.721674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418340.848384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418340.978495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418341.106524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418341.233106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418341.369084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418341.497001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418341.657762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418341.783186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418341.927988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418342.043860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418342.168384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418342.313155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418342.442586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418342.557620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418342.707002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418342.841223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418342.975796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418343.094302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418343.225610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418343.344092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418343.480783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418343.605066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418343.745111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418343.870289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418343.993943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418344.126777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418344.284642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418344.410240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418344.544544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418344.665122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418344.796592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418344.920629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418345.052272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418345.175731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418345.307407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418345.441031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418345.584003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418345.715584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418345.848183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418345.978526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418346.108068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418346.233654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418346.377162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418346.518643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418346.644964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418346.772775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418346.916657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418347.064393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418347.170064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418347.302875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418347.426971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418347.553077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418347.687392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418347.810112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418347.959969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418348.073696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418348.214844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418348.348495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418348.483031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418348.602259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418348.732794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418348.868485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418348.990258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418349.135847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418349.253031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418349.394513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418349.531188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418349.656215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418349.787759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418349.905706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418350.041106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418350.167361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418350.298881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418350.432960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418350.543951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418350.672215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418350.811112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418350.933706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418351.102755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418351.222378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418351.352457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418351.498487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418351.612539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418351.737082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418351.872343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418352.005133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418352.138527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418352.263945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418352.386455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418352.518933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418352.676428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418352.814713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418352.925849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418353.049369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418353.200065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418353.326147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418353.454398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418353.609838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418353.720785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418353.853700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418353.978348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418354.105217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418354.234465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418354.361658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418354.488000]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418354.618905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418354.753440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418354.891425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418355.017851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418355.150904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418355.287240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418355.405809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418355.540095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418355.671679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418355.793655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418355.917426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418356.045181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418356.159009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418356.296402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418356.420400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418356.547832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418356.673996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418356.864529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418357.054279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418357.228708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418357.358537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418357.485144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418357.612341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418357.764965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418357.872683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418358.016378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418358.131128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418358.285614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418358.407843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418358.541754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418358.664114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418358.795524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418358.925130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418359.057725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418359.189245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418359.330930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418359.468069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418359.607314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418359.722782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418359.856864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418359.994068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418360.142663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418360.266987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418360.415242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418360.535336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418360.664732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418360.787871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418360.915943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418361.058302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418361.173106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418361.297894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418361.431555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418361.559580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418361.688392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418361.820651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418361.982851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418362.122163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418362.241597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418362.370740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418362.498527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418362.627004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418362.768534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418362.899015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418363.039991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418363.180731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418363.298467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418363.431384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418363.582518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418363.725205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418363.855568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418363.989658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418364.123286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418364.247395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418364.393884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418364.529739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418364.663511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418364.783389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418364.920607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418365.033526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418365.172309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418365.295295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418365.426749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418365.558097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418365.702170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418365.834255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418365.973229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418366.090931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418366.220784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418366.349781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418366.479885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418366.608261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418366.736764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418366.855936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418366.992645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418367.126408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418367.259559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418367.402958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418367.533923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418367.654245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418367.796116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418367.922340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418368.052649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418368.181910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418368.311743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418368.451396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418368.601604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418368.733849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418368.846021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418368.981680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418369.107486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418369.235580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418369.364694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418369.495940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418369.645105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418369.765979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418369.904813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418370.028395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418370.165115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418370.289994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418370.418237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418370.540019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418370.680928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418370.797818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418370.924820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418371.048176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418371.177318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418371.307920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418371.443824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418371.566838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418371.709355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418371.837802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418371.975075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418372.117795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418372.236647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418372.368650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418372.487912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418372.613322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418372.745225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418372.873155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418373.019712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418373.145708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418373.286448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418373.408008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418373.541989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418373.665545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418373.800767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418373.938396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418374.058757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418374.186605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418374.327400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418374.455133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418374.578780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418374.715227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418374.844223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418374.978181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418375.130580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418375.236313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418375.385512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418375.511697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418375.656920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418375.790498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418375.929744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418376.076974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418376.211033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418376.330631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418376.471088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418376.599763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418376.733823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418376.862558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418377.003109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418377.125089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418377.265992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418377.401739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418377.531811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418377.669443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418377.796235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418377.932602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418378.065423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418378.190043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418378.325104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418378.466206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418378.597038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418378.720681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418378.848953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418378.975330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418379.103016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418379.220008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418379.349719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418379.478295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418379.614333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418379.731479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418379.858704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418380.000017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418380.145177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418380.260769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418380.403853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418380.529244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418380.661340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418380.795606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418380.921420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418381.042606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418381.170926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418381.295779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418381.432512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418381.559798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418381.697365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418381.828863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418381.979099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418382.114831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418382.240921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418382.359588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418382.491287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418382.640565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418382.745162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418382.877901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418383.034341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418383.151067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418383.303908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418383.408440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418383.541426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418383.661810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418383.792088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418383.907080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418384.039244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418384.170957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418384.303793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418384.434439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418384.569775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418384.702776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418384.831731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418384.962812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418385.102968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418385.231502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418385.358735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418385.485051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418385.615331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418385.737806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418385.879360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418386.013362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418386.156107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418386.298677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418386.506221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418386.817373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418387.080426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418387.223851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418387.367019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418387.474640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418387.607246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418387.732159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418387.871367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418388.007002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418388.142589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418388.274270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418388.408428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418388.548096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418388.706229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418388.836459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418388.972703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418389.102197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418389.232598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418389.358313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418389.487350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418389.610898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418389.748024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418389.876727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418390.034938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418390.160165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418390.291875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418390.407081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418390.542659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418390.661568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418390.793569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418390.919664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418391.064406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418391.184338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418391.320866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418391.446851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418391.583416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418391.712565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418391.854177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418391.994555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418392.129164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418392.266761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418392.403688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418392.534338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418392.667466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418392.790289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418392.921146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418393.043303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418393.172137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418393.293116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418393.431908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418393.545422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418393.674258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418393.804730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418393.943187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418394.080449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418394.206431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418394.339481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418394.474514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418394.600068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418394.741502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418394.869725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418395.000203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418395.137957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418395.250776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418395.391835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418395.521334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418395.647204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418395.782772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418395.917819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418396.041663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418396.169117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418396.301283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418396.422791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418396.551113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418396.682881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418396.816993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418396.956436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418397.094085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418397.223735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418397.348730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418397.468379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418397.602824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418397.730570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418397.859687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418397.995806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418398.138779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418398.256650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418398.395080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418398.536885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418398.663781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418398.785661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418398.921532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418399.048347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418399.200733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418399.329073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418399.457749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418399.595335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418399.747395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418399.856198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418399.995074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418400.125370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418400.275535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418400.409820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418400.552130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418400.667236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418400.804440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418400.937212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418401.082029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418401.212842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418401.348165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418401.478056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418401.602680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418401.726355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418401.853595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418401.981541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418402.119587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418402.230115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418402.358249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418402.487459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418402.622196]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418402.742999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418402.892332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418403.017722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418403.159883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418403.289638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418403.415012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418403.533659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418403.686424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418403.789085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418403.922986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418404.048476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418404.181810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418404.316491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418404.465770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418404.584073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418404.723070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418404.848536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418404.978724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418405.106822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418405.237551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418405.370833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418405.496402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418405.639633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418405.773223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418405.907619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418406.034926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418406.161928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418406.303697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418406.420216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418406.558468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418406.699140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418406.844687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418406.965955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418407.099729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418407.221647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418407.371198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418407.483575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418407.617668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418407.735356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418407.881302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418407.996924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418408.123242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418408.262684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418408.406543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418408.531458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418408.660142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418408.788467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418408.918586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418409.047388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418409.180242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418409.321847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418409.466218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418409.587591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418409.706977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418409.837727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418409.971795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418410.112106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418410.223324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418410.361691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418410.476264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418410.615557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418410.727954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418410.852521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418410.988440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418411.111931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418411.265927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418411.375115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418411.527756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418411.660234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418411.792216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418411.914923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418412.045567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418412.172868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418412.308875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418412.433516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418412.567218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418412.704838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418412.862744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418412.969351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418413.108274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418413.219708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418413.342260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418413.471430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418413.606387]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418413.717161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418413.862561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418413.978027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418414.110175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418414.245908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418414.371025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418414.498576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418414.643855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418414.759782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418414.900660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418415.022643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418415.154654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418415.284534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418415.428175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418415.535166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418415.668643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418415.794756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418415.924125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418416.046741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418416.180921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418416.311744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418416.455562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418416.581054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418416.725486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418416.839307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418416.970248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418417.096607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418417.260752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418417.371618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418417.516978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418417.652451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418417.792726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418417.932764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418418.058811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418418.185512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418418.328007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418418.453340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418418.615917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418418.726130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418418.863618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418418.984356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418419.136867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418419.266442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418419.396214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418419.526601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418419.658814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418419.801971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418419.921925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418420.050302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418420.184257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418420.311194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418420.452722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418420.587626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418420.715068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418420.843402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418420.973665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418421.101646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418421.227780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418421.358709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418421.494621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418421.637981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418421.767761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418421.906925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418422.058116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418422.182734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418422.327092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418422.458487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418422.594547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418422.712558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418422.852728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418422.981477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418423.105454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418423.224503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418423.355131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418423.478135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418423.620020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418423.728843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418423.860590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418424.120140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418424.274326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418424.407522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418424.528455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418424.657626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418424.779240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418424.909321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418425.044745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418425.163813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418425.294471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418425.421559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418425.547540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418425.693818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418425.829255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418425.956453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418426.095135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418426.230334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418426.355831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418426.488318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418426.619340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418426.753778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418426.891167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418427.017331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418427.153554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418427.284222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418427.401305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418427.538716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418427.663927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418427.795140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418427.934064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418428.090151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418428.209538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418428.340738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418428.473786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418428.606061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418428.726448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418428.854337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418428.980596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418429.114938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418429.243238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418429.387306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418429.496622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418429.635564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418429.770854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418429.902392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418430.032358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418430.165035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418430.291044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418430.417040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418430.562088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418430.701593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418430.822551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418430.973293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418431.099164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418431.226583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418431.360591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418431.480508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418431.610740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418431.735611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418431.864530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418432.014410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418432.136164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418432.271825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418432.391717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418432.555445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418432.688046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418432.831616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418432.951224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418433.081297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418433.214821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418433.330211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418433.467638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418433.598576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418433.723603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418433.852115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418433.976505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418434.110203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418434.226375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418434.357312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418434.492135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418434.622594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418434.780458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418434.916448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418435.036243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418435.163786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418435.291790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418435.415116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418435.537319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418435.669276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418435.824440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418435.956021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418436.089558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418436.220727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418436.347024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418436.492087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418436.597751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418436.713496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418436.843265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418436.984091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418437.099478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418437.247630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418437.360056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418437.487339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418437.620098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418437.752931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418437.888348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418438.029001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418438.150746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418438.288113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418438.429430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418438.537230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418438.651698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418438.791721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418438.918974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418439.048551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418439.180923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418439.304835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418439.431632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418439.566044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418439.703584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418439.846956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418439.975576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418440.107405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418440.240556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418440.357297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418440.494059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418440.632440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418440.732002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418440.870823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418441.010463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418441.152107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418441.281303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418441.425289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418441.536809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418441.670807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418441.794445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418441.940210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418442.074021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418442.205462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418442.338711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418442.487386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418442.607669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418442.724815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418442.847830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418442.979218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418443.108982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418443.241580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418443.368190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418443.521343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418443.634850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418443.786757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418443.899507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418444.028859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418444.160079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418444.293951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418444.739659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418444.897083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418445.058728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418445.204663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418445.332062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418445.460663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418445.599836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418445.737046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418445.850047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418445.979793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418446.107350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418446.232666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418446.366521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418446.498787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418446.640308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418446.770057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418446.896395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418447.033175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418447.164480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418447.305527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418447.426926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418447.547073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418447.681328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418447.816325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418447.945489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418448.084648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418448.233669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418448.341751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418448.476334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418448.618013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418448.729882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418448.856815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418448.991983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418449.117793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418449.267155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418449.564112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418449.721952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418449.853689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418449.986575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418450.110391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418450.232579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418450.356826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418450.484528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418450.636353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418450.769725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418450.892069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418451.028012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418451.162624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418451.288226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418451.420796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418451.542403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418451.672683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418451.814685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418451.958922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418452.089987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418452.235784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418452.349755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418452.480594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418452.612202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418452.745861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418452.885209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418453.015022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418453.151579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418453.287049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418453.408442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418453.533236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418453.670478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418453.793508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418453.918561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418454.046731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418454.169288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418454.303249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418454.457045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418454.576782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418454.702881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418454.847644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418454.964085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418455.098211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418455.221729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418455.348519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418455.471784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418455.601274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418455.728281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418455.858031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418455.985186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418456.112932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418456.255217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418456.372368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418456.515214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418456.632022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418456.769281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418456.913110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418457.034169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418457.164225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418457.296708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418457.490330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418457.636951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418457.765461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418457.901345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418458.032771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418458.164514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418458.289006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418458.407053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418458.543168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418458.676253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418458.807671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418458.949993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418459.095515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418459.205925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418459.338337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418459.616280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418459.768414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418459.901702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418460.028347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418460.164268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418460.285919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418460.416651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418460.537480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418460.668803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418460.794851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418460.934814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418461.074731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418461.200507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418461.331929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418461.457774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418461.582984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418461.722185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418461.858667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418461.982878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418462.103528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418462.232135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418462.367068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418462.489706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418462.616053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418462.764430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418462.902572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418463.036688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418463.166925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418463.292084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418463.418480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418463.548789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418463.689041]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418463.849048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418463.967170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418464.099815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418464.224774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418464.349541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418464.609582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418464.742463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418464.871400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418465.003010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418465.135682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418465.274507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418465.404497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418465.525606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418465.671736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418465.784982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418465.918296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418466.052327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418466.179274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418466.309963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418466.451758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418466.575656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418466.719675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418466.846879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418466.976361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418467.099322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418467.232806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418467.356450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418467.489750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418467.616132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418467.744847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418467.886623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418468.017874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418468.162601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418468.288358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418468.412579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418468.537766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418468.678979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418468.791178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418468.920921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418469.057173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418469.188418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418469.326211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418469.618183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418469.726614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418469.861671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418469.983997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418470.158020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418470.283183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418470.413610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418470.529578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418470.676662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418470.780500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418470.928108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418471.046374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418471.173220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418471.302959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418471.437036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418471.574229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418471.703844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418471.854975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418471.981742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418472.109198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418472.254750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418472.366558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418472.491857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418472.620470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418472.765329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418472.904366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418473.037364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418473.165733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418473.309916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418473.431918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418473.556634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418473.689662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418473.834031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418473.955426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418474.097211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418474.223707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418474.598418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418474.746052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418474.915630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418475.041871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418475.170844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418475.295392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418475.423563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418475.544945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418475.683024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418475.811105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418475.966367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418476.094702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418476.253536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418476.401256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418476.537272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418476.657825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418476.783981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418476.921779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418477.044572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418477.170100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418477.306286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418477.426274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418477.555899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418477.696706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418477.840282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418477.971832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418478.100298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418478.212793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418478.343640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418478.474763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418478.604351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418478.731019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418478.858324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418478.995783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418479.123743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418479.264872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418479.391367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418479.535017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418479.660585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418479.789315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418479.921798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418480.057687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418480.197246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418480.302889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418480.452538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418480.599847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418480.732006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418480.858432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418480.991354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418481.122905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418481.269962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418481.386928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418481.517283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418481.652125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418481.790795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418481.906538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418482.062320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418482.201555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418482.362758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418482.466361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418482.597111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418482.730284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418482.873915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418482.991218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418483.133179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418483.263144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418483.410127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418483.526418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418483.679039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418483.782647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418483.917120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418484.045225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418484.178888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418484.309918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418484.455885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418484.588632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418484.719193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418484.840521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418484.967839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418485.095445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418485.228886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418485.352004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418485.485092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418485.604747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418485.721554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418485.852432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418485.984642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418486.108151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418486.239981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418486.374508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418486.506728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418486.651678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418486.785363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418486.914037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418487.042315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418487.183969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418487.292908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418487.416125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418487.547492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418487.676886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418487.819757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418487.951904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418488.089899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418488.215760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418488.341508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418488.469934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418488.617221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418488.730388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418488.858565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418488.991576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418489.141896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418489.269358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418489.420353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418489.527793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418489.655141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418489.786797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418489.915946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418490.042398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418490.171439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418490.294194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418490.449409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418490.575558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418490.689012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418490.828914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418490.981744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418491.112453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418491.238538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418491.383982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418491.502201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418491.636648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418491.766006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418491.915176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418492.036458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418492.163728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418492.287519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418492.414077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418492.543092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418492.678194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418492.794744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418492.919792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418493.048806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418493.174908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418493.303104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418493.437503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418493.570917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418493.703809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418493.828944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418493.975060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418494.105005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418494.225445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418494.359453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418494.480858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418494.613600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418494.740343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418494.881010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418494.993054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418495.171947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418495.268962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418495.412663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418495.522739]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418495.651632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418495.779127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418495.948726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418496.074581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418496.203471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418496.331642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418496.473015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418496.597482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418496.726066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418496.851094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418496.989571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418497.107717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418497.246644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418497.382192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418497.498882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418497.637182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418497.770566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418497.902942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418498.033907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418498.159652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418498.301065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418498.426032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418498.537066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418498.664265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418498.800527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418498.926847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418499.058157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418499.186345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418499.330660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418499.472055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418499.594498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418499.729652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418499.853150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418499.978149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418500.119319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418500.240690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418500.381544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418500.499483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418500.676301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418500.788165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418500.912030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418501.040110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418501.163172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418501.279485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418501.413628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418501.542548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418501.686799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418501.807782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418501.951229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418502.064542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418502.207453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418502.350811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418502.476982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418502.596939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418502.717072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418502.866309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418502.981551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418503.104972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418503.244116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418503.368726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418503.513806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418503.645856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418503.787232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418503.907224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418504.034922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418504.159347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418504.291407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418504.428328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418504.549680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418504.688242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418504.822792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418504.953764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418505.077268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418505.211074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418505.369026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418505.634926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418505.930337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418506.246908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418506.651160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418506.995290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418507.388238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418507.827293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418508.057225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418508.291670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418508.459983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418508.642006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418508.807714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418508.973255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418509.166163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418509.356524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418509.536643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418509.671166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418509.864977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418510.040004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418510.213150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418510.396110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418510.566978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418510.761139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418510.908133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418511.084436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418511.243129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418511.418006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418511.599540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418511.765099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418512.009437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418512.168211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418512.353262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418512.514747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418512.672144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418512.859318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418513.042364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418513.197576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418513.363495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418513.555488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418513.712299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418513.911036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418514.150047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418514.333769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418514.552553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418514.723488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418514.891571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418515.067412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418515.258992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418515.388332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418515.552712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418515.748845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418515.877199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418516.076274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418516.325428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418516.616504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418516.864975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418517.064604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418517.199400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418517.331194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418517.476622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418517.613760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418517.742542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418517.910625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418518.115943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418518.289189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418518.479693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418518.643926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418518.821722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418519.014618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418519.194319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418519.346675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418519.528732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418519.699042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418519.907483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418520.049604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418520.217571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418520.406441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418520.562258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418520.740044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418520.920070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418521.095965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418521.267081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418521.452601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418521.623277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418521.793042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418522.004252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418522.143548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418522.312030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418522.476848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418522.648249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418522.822580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418523.088897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418523.362710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418523.637759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418523.884035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418524.022700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418524.156648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418524.280980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418524.416252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418524.540843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418524.677886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418524.800580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418524.956532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418525.075228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418525.204011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418525.340144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418525.463010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418525.588826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418525.719426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418525.846514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418526.029902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418526.231557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418526.365624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418526.498225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418526.621242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418526.756825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418526.880490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418527.030248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418527.163422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418527.293133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418527.419088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418527.554692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418527.695013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418527.802515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418527.950417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418528.084885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418528.213247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418528.343023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418528.466628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418528.611666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418528.712186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418528.853466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418528.972088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418529.101286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418529.226880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418529.356837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418529.487045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418529.613656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418529.756845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418529.871204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418530.022359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418530.146569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418530.272404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418530.409688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418530.536409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418530.662363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418530.782695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418530.911835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418531.046748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418531.158069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418531.304152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418531.438224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418531.569161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418531.715627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418531.845527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418531.974543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418532.103892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418532.229616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418532.351264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418532.483280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418532.619512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418532.747192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418532.887275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418533.010878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418533.138458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418533.278308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418533.404331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418533.534189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418533.658289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418533.787388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418533.928761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418534.049020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418534.181806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418534.343771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418534.471884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418534.600933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418534.727332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418534.852224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418534.974183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418535.095987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418535.222668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418535.355644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418535.488590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418535.603947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418535.737975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418535.867890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418536.007774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418536.140409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418536.276928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418536.423147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418536.534813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418536.667315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418536.804512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418536.918251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418537.044607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418537.199462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418537.301295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418537.435938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418537.572417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418537.716228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418537.861300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418537.978533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418538.105819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418538.236947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418538.366018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418538.504134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418538.636497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418538.792571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418538.909183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418539.035939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418539.162096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418539.302668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418539.420066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418539.548677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418539.678966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418539.806667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418539.962086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418540.097584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418540.217724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418540.363866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418540.543263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418540.677516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418540.799308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418540.927150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418541.065825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418541.203319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418541.333581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418541.474442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418541.590901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418541.726464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418541.864526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418542.011354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418542.145302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418542.286122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418542.406645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418542.539467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418542.671344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418542.803192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418542.950641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418543.076975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418543.207809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418543.350064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418543.491585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418543.603903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418543.745559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418543.870966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418544.017928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418544.152204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418544.295883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418544.414281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418544.543176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418544.693359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418544.822953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418544.956946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418545.081807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418545.209668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418545.336707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418545.484382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418545.593800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418545.709222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418545.854150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418545.983451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418546.105743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418546.243601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418546.368566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418546.520431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418546.654704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418546.778661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418546.913777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418547.049284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418547.189791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418547.324897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418547.454283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418547.596614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418547.722088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418547.843865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418547.979064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418548.132057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418548.249157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418548.409837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418548.529710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418548.658043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418548.782950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418548.919623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418549.045088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418549.166979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418549.292321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418549.436405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418549.557471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418549.701697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418549.840246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418549.972306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418550.093829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418550.221722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418550.348051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418550.477285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418550.599028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418550.739095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418550.873001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418551.013769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418551.137968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418551.282715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418551.407662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418551.531551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418551.658701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418551.788434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418551.913336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418552.034064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418552.158562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418552.290466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418552.413429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418552.551758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418552.673165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418552.820707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418552.935887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418553.072844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418553.219801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418553.342974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418553.465782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418553.600898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418553.720870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418553.852607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418553.976575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418554.105347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418554.228777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418554.363216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418554.492687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418554.615288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418554.758469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418554.906849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418555.022378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418555.159653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418555.289955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418555.449816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418555.554403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418555.700355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418555.828102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418555.964556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418556.112180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418556.245727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418556.379273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418556.515412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418556.647054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418556.777831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418556.908245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418557.042480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418557.172190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418557.301435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418557.450227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418557.571826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418557.702280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418557.843855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418557.971960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418558.104033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418558.242375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418558.342516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418558.477461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418558.615634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418558.740065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418558.875001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418559.015802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418559.172112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418559.276062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418559.410038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418559.542412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418559.667635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418559.808413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418559.928292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418560.066006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418560.213837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418560.335605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418560.478381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418560.589363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418560.735540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418560.866618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418561.043190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418561.221417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418561.434339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418561.572788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418561.737577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418561.917555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418562.064010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418562.212296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418562.381830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418562.551659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418562.701779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418562.866263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418562.999886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418563.179154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418563.331110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418563.518025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418563.690004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418563.844030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418563.988085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418564.167184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418564.277978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418564.425091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418564.595584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418564.737938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418564.955096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418565.090466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418565.300652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418565.477883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418565.606481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418565.747415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418565.957847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418566.208896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418566.407275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418566.571233]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418566.691174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418566.825267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418566.967957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418567.099729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418567.221593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418567.349098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418567.481299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418567.613315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418567.743257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418567.892885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418568.021902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418568.163051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418568.290022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418568.429582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418568.573500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418568.726090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418568.852689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418568.996548]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418569.103164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418569.239046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418569.379469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418569.489727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418569.621627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418569.761284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418569.893048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418570.052253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418570.152980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418570.292355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418570.427716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418570.552347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418570.680894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418570.824754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418570.960449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418571.096144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418571.224519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418571.347315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418571.477337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418571.621223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418571.738193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418571.883989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418572.029022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418572.164330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418572.300447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418572.435390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418572.567641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418572.697236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418572.832017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418572.971223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418573.100260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418573.222023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418573.342770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418573.506238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418573.604661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418573.757973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418573.885298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418574.016845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418574.151724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418574.289846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418574.413514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418574.542545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418574.666206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418574.795715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418574.934215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418575.072420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418575.205225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418575.331520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418575.465946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418575.601110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418575.726035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418575.863303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418575.995621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418576.151159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418576.268631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418576.409552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418576.526937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418576.664141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418576.791685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418576.916401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418577.052527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418577.182407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418577.308307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418577.445825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418577.590803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418577.719326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418577.843255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418577.973594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418578.102430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418578.229725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418578.369277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418578.504400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418578.619265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418578.760578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418578.901769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418579.034237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418579.165040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418579.269288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418579.413509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418579.554572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418579.677677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418579.827172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418579.955714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418580.088814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418580.220154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418580.360672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418580.472959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418580.604750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418580.750522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418580.909208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418581.034931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418581.161560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418581.286984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418581.411588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418581.542205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418581.680106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418581.799926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418581.943799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418582.067992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418582.205309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418582.334072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418582.473625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418582.604226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418582.724682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418582.845062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418582.976452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418583.102663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418583.233565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418583.372823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418583.511307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418583.651582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418583.778224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418583.905953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418584.032784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418584.159126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418584.301226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418584.409868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418584.539015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418584.673781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418584.808181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418584.931593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418585.052414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418585.184046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418585.326370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418585.462981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418585.595778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418585.712597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418585.849922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418585.979699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418586.110736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418586.246168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418586.388057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418586.521210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418586.666920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418586.778876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418586.916314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418587.040696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418587.181551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418587.316332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418587.467526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418587.598310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418587.726080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418587.859915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418587.974040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418588.100219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418588.229759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418588.361044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418588.492446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418588.613677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418588.760622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418588.906445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418589.031132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418589.158438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418589.288442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418589.410526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418589.541801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418589.670024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418589.800561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418589.940491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418590.085144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418590.203228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418590.332650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418590.470787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418590.595449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418590.720836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418590.850772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418590.978109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418591.106998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418591.241566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418591.382943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418591.530068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418591.664676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418591.787637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418591.918630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418592.048813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418592.177715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418592.310933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418592.462509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418592.593532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418592.717010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418592.845588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418592.976174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418593.101929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418593.229969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418593.354094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418593.493816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418593.629908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418593.765493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418593.888560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418594.019278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418594.148449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418594.283110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418594.411313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418594.542804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418594.684838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418594.801002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418594.949945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418595.092554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418595.217823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418595.346343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418595.470083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418595.597270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418595.723688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418595.861758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418596.000770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418596.132264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418596.257697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418596.409477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418596.531728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418596.657193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418596.780563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418596.911168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418597.037050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418597.171703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418597.300088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418597.437328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418597.577269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418597.763777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418597.897236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418598.031492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418598.164330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418598.284642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418598.410870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418598.539096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418598.664941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418598.804715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418598.949712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418599.074659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418599.223373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418599.341776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418599.478733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418599.612603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418599.729887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418599.848498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418600.004705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418600.137228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418600.273833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418600.409348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418600.526982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418600.660051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418600.799278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418600.915707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418601.036915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418601.160244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418601.290956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418601.414447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418601.536987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418601.666700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418601.798346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418601.972868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418602.111576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418602.245373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418602.374171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418602.502710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418602.639938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418602.769440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418602.903150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418603.033637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418603.151171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418603.280831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418603.411867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418603.541121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418603.664830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418603.800620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418603.937209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418604.068352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418604.213238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418604.350591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418604.469440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418604.600151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418604.729852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418604.867315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418604.988391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418605.136706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418605.254707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418605.404461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418605.524450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418605.663870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418605.788621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418605.921749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418606.049010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418606.184670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418606.324302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418606.478173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418606.596104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418606.724693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418606.852676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418606.987151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418607.122095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418607.267881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418607.382568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418607.514985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418607.662614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418607.781365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418607.926756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418608.076521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418608.189307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418608.349951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418608.475840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418608.614625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418608.734485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418608.883015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418609.011716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418609.159659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418609.278362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418609.410583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418609.537331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418609.664670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418609.790923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418609.935870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418610.074010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418610.227719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418610.341350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418610.470959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418610.597494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418610.737595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418610.859758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418611.000575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418611.155710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418611.287086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418611.410256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418611.526544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418611.669761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418611.786465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418611.911062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418612.058726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418612.174100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418612.311355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418612.434270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418612.577493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418612.708149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418612.854160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418612.987361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418613.115208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418613.255159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418613.397217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418613.523068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418613.657983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418613.778482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418613.909069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418614.042671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418614.168297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418614.293044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418614.426199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418614.549628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418614.693673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418614.827092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418614.954401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418615.090888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418615.221523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418615.345060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418615.474467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418615.602967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418615.749343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418615.869482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418616.022581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418616.157201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418616.288385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418616.410280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418616.541634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418616.679799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418616.814959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418616.923483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418617.073570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418617.192835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418617.358674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418617.463151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418617.588925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418617.716774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418617.844655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418617.969671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418618.108412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418618.225920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418618.355382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418618.486538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418618.630211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418618.766140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418618.929049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418619.090504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418619.226142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418619.347931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418619.474993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418619.601370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418619.747912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418619.863849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418619.996926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418620.147914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418620.277962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418620.403331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418620.533281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418620.656347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418620.789695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418620.919781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418621.047230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418621.180594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418621.323812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418621.453291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418621.593346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418621.712272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418621.846039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418621.979162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418622.109053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418622.238965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418622.372892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418622.502257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418622.666811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418622.802229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418622.929147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418623.067666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418623.190126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418623.350949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418623.467124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418623.586766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418623.720918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418623.841977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418623.977090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418624.095308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418624.224708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418624.353055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418624.482934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418624.635194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418624.751076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418624.881326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418625.011899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418625.152895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418625.290521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418625.427109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418625.557207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418625.683133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418625.825757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418625.986357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418626.150060]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418626.282388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418626.465358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418626.596453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418626.764732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418626.906251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418627.059523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418627.217445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418627.360994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418627.500451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418627.743709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418627.893742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418628.034753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418628.162026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418628.293939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418628.431492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418628.555919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418628.695522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418628.859120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418628.964526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418629.092179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418629.258806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418629.412893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418629.538103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418629.670433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418629.803832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418629.929430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418630.054171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418630.188774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418630.323090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418630.464125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418630.588966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418630.719348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418630.843595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418630.973809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418631.098153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418631.221682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418631.346775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418631.474426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418631.591136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418631.727863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418631.852502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418632.014958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418632.153737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418632.283200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418632.404241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418632.534992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418632.666284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418632.798787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418632.919308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418633.050678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418633.199930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418633.340580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418633.459377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418633.587628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418633.716381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418633.864373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418633.984502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418634.106653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418634.226360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418634.370191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418634.502773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418634.638490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418634.778205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418634.912728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418635.041715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418635.177369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418635.301770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418635.427728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418635.557089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418635.707096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418635.843261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418635.979277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418636.129295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418636.258459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418636.388946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418636.519148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418636.648474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418636.791525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418636.903388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418637.036263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418637.174390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418637.299124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418637.430108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418637.552628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418637.695522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418637.825981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418637.956381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418638.100768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418638.220097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418638.356091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418638.477735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418638.608965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418638.745085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418638.896001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418639.018571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418639.157551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418639.279999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418639.406535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418639.531185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418639.657912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418639.789699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418639.927448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418640.049712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418640.199268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418640.322870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418640.452022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418640.580776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418640.715560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418640.838696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418640.971145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418641.104880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418641.250738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418641.363456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418641.496660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418641.636379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418641.771614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418641.901810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418642.035111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418642.171226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418642.285579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418642.405105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418642.536354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418642.659726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418642.792020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418642.914979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418643.054665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418643.177474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418643.309105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418643.444840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418643.585794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418643.712018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418643.838105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418643.980822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418644.111502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418644.223978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418644.344851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418644.489016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418644.630648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418644.755757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418644.886318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418645.016451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418645.165952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418645.274811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418645.423801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418645.529322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418645.672713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418645.801808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418645.930905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418646.063064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418646.212137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418646.336763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418646.477087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418646.592843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418646.717172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418646.850736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418646.977587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418647.116287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418647.259707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418647.401695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418647.532620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418647.649729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418647.785718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418647.902146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418648.030502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418648.172599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418648.294928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418648.421688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418648.565717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418648.703265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418648.841290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418648.963914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418649.097138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418649.219083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418649.350057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418649.477660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418649.599335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418649.726605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418649.852076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418649.983370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418650.132593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418650.276963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418650.406245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418650.530942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418650.665872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418650.790879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418650.922833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418651.056434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418651.201290]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418651.338317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418651.460147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418651.591561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418651.713535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418651.838878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418651.966435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418652.090003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418652.222916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418652.345088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418652.474323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418652.607855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418652.738371]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418652.863380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418653.009035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418653.135378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418653.263928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418653.388482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418653.524355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418653.655845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418653.785200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418653.911377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418654.050056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418654.161174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418654.295222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418654.424024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418654.553097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418654.696584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418654.823062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418654.971846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418655.100535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418655.225033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418655.351804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418655.480342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418655.615752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418655.740359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418655.900091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418656.009523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418656.139431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418656.298512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418656.410451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418656.535951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418656.661523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418656.785977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418656.918262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418657.055109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418657.194131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418657.318231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418657.470347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418657.604226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418657.720585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418657.859562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418658.005355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418658.134365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418658.284530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418658.398854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418658.531805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418658.660653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418658.776706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418658.914215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418659.054966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418659.166014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418659.299046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418659.417022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418659.553972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418659.679430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418659.821811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418659.947345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418660.091963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418660.216599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418660.361324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418660.467668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418660.598882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418660.729104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418660.852619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418660.990279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418661.127383]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418661.270620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418661.404239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418661.543374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418661.652961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418661.777568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418661.905757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418662.073082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418662.212413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418662.334362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418662.467578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418662.600854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418662.720741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418662.844792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418662.978899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418663.105188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418663.301952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418663.423580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418663.550330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418663.697842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418663.835592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418663.967031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418664.097296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418664.218113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418664.341947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418664.467582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418664.597913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418664.722951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418664.865220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418664.992164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418665.150118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418665.266068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418665.405216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418665.535985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418665.656123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418665.783688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418665.911926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418666.037648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418666.172092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418666.305488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418666.444907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418666.570751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418666.718740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418666.851020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418666.967321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418667.098682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418667.286605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418667.483356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418667.628879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418667.750841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418667.903302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418668.036388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418668.173594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418668.297934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418668.440262]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418668.578328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418668.717076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418668.841105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418668.970415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418669.109005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418669.233976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418669.346593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418669.487295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418669.618227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418669.738861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418669.889499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418670.035194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418670.152633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418670.277653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418670.406972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418670.532840]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418670.656748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418670.802017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418670.922359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418671.054635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418671.194902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418671.329328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418671.454353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418671.587140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418671.730110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418671.844661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418671.970719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418672.112058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418672.225368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418672.354659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418672.484660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418672.615685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418672.737200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418672.895345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418673.017010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418673.151857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418673.268950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418673.403961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418673.527167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418673.664035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418673.785254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418673.921243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418674.051701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418674.185622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418674.321919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418674.481521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418674.587980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418674.711949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418674.862753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418674.977855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418675.105544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418675.236554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418675.370999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418675.498531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418675.627684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418675.768764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418675.907144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418676.047651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418676.179959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418676.321695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418676.445481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418676.576363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418676.718001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418676.842008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418676.970845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418677.092626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418677.211696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418677.360366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418677.464914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418677.586523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418677.721756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418677.863001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418677.980784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418678.132892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418678.316947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418678.443412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418678.570428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418678.700216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418678.837997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418678.967578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418679.085250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418679.219638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418679.338442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418679.472832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418679.590775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418679.720254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418679.845993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418679.993831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418680.130314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418680.263392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418680.393372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418680.523133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418680.653076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418680.783700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418680.907866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418681.047745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418681.180740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418681.320276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418681.442893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418681.586221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418681.713138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418681.838179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418681.968441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418682.093741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418682.220335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418682.348420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418682.474392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418682.603189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418682.739148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418682.853132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418682.995352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418683.126591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418683.255924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418683.402348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418683.525938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418683.661083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418683.779743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418683.911724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418684.045593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418684.166508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418684.305098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418684.447985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418684.574976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418684.714343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418684.840802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418684.972934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418685.094470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418685.225177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418685.347670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418685.480005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418685.604751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418685.734512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418685.868990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418685.998595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418686.130837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418686.287200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418686.536784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418686.706985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418686.844912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418686.968067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418687.098066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418687.218003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418687.344574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418687.477753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418687.609793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418687.736046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418687.878790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418688.015167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418688.158044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418688.280103]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418688.410369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418688.548627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418688.682442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418688.825311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418688.943140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418689.083901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418689.221428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418689.351738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418689.474602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418689.601959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418689.735766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418689.867902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418690.007848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418690.141258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418690.268924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418690.420266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418690.534160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418690.656442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418690.785598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418690.910222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418691.047482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418691.175409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418691.307184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418691.443753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418691.578953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418691.705789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418691.839032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418692.000605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418692.134770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418692.274574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418692.402536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418692.546565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418692.692158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418692.820856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418692.943845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418693.075057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418693.218066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418693.345491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418693.485709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418693.600648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418693.728633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418693.866865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418694.012116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418694.132666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418694.263002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418694.390898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418694.531216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418694.643463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418694.774856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418694.909595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418695.031677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418695.157457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418695.288668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418695.416933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418695.541882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418695.688585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418695.812138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418695.944976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418696.094220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418696.343413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418696.612586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418696.903039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418697.320208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418697.698620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418698.092417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418698.382946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418698.697477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418698.937304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418699.142887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418699.322449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418699.568576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418699.766605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418699.902461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418700.069787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418700.227278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418700.403614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418700.596575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418700.750037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418700.941017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418701.084870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418701.277447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418701.448646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418701.630853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418701.807014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418701.949217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418702.117456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418702.322891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418702.471487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418702.658988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418702.862223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418703.019972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418703.202092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418703.370067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418703.529605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418703.698231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418703.909721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418704.060797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418704.217141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418704.386193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418704.570073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418704.731415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418704.912255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418705.094730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418705.260099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418705.518740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418705.719812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418705.898280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418706.090816]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418706.217059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418706.424388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418706.570095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418706.719098]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418706.874111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418707.035444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418707.223779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418707.409310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418707.722663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418708.017359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418708.214289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418708.348053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418708.483910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418708.624279]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418708.754046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418708.901907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418709.033938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418709.184788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418709.398813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418709.531895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418709.737427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418709.904624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418710.038324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418710.223162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418710.400474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418710.586731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418710.756863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418710.940710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418711.091036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418711.288307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418711.470782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418711.606405]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418711.782306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418711.987288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418712.129708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418712.330337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418712.491849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418712.660798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418712.851519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418713.010127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418713.200655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418713.369600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418713.515541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418713.694990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418713.854189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418714.053574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418714.215432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418714.434242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418714.607523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418715.028762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418715.289807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418715.477604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418715.644823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418715.771957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418715.903168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418716.043736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418716.175147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418716.295480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418716.437200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418716.567827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418716.703563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418716.828485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418716.975009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418717.081592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418717.205165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418717.356528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418717.475657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418717.701741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418717.859908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418718.004725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418718.125819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418718.259200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418718.389403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418718.533615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418718.653302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418718.784559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418718.907928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418719.038888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418719.218661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418719.345344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418719.479202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418719.609433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418719.732690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418719.873825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418720.010853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418720.152197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418720.277520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418720.411885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418720.531369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418720.660169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418720.791948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418720.928486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418721.046416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418721.188337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418721.313911]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418721.447951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418721.579381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418721.721472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418721.844531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418722.002781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418722.134338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418722.264858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418722.388247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418722.524455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418722.649582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418722.777920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418722.944802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418723.056566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418723.187628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418723.321561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418723.462300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418723.590615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418723.725794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418723.866135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418724.015239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418724.154538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418724.282455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418724.423605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418724.534750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418724.672118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418724.800569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418724.942488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418725.073632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418725.200533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418725.329950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418725.469602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418725.592542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418725.717956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418725.843659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418725.977439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418726.112633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418726.255958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418726.387501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418726.525830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418726.652517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418726.781312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418726.903374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418727.045945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418727.152114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418727.282991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418727.413456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418727.547872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418727.673741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418727.807331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418727.958545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418728.091884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418728.233597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418728.364919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418728.507151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418728.643837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418728.765133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418728.912575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418729.019242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418729.158538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418729.281706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418729.407239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418729.526587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418729.672570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418729.801763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418729.920699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418730.037990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418730.170774]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418730.301615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418730.434939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418730.563393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418730.697773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418730.824184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418730.962749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418731.080151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418731.234187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418731.335139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418731.458354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418731.609559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418731.730453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418731.859357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418731.984128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418732.118808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418732.256932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418732.381740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418732.507018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418732.651231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418732.786443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418732.922148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418733.030600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418733.153358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418733.313538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418733.408016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418733.540963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418733.667990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418733.815197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418733.955859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418734.106158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418734.214314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418734.353777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418734.538261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418734.674030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418734.808831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418734.948837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418735.083780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418735.210263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418735.330632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418735.467781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418735.590116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418735.716148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418735.838355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418735.989573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418736.140389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418736.271935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418736.391316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418736.527304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418736.657344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418736.784416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418736.904036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418737.032629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418737.163304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418737.292325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418737.421827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418737.562385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418737.679495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418737.820649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418737.953917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418738.091792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418738.210664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418738.340540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418738.462069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418738.596171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418738.718959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418738.860820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418738.990613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418739.138673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418739.270975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418739.410523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418739.549005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418739.675517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418739.783882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418739.919479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418740.044095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418740.179670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418740.318198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418740.459735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418740.574766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418740.717804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418740.835744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418740.970134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418741.090812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418741.220323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418741.346448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418741.472484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418741.597629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418741.745848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418741.867917]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418742.007125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418742.138055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418742.284973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418742.403365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418742.533851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418742.656868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418742.798084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418742.926837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418743.062796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418743.178821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418743.327556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418743.457228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418743.596521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418743.705320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418743.844382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418743.964841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418744.090164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418744.217823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418744.344689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418744.467650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418744.599342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418744.720348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418744.856101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418744.975478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418745.115660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418745.239609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418745.397972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418745.513590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418745.653485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418745.789880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418745.908130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418746.025907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418746.155972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418746.282579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418746.410799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418746.529820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418746.658102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418746.783404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418746.914109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418747.047952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418747.195111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418747.318790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418747.455416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418747.583189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418747.709165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418747.840649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418747.975206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418748.094413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418748.233693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418748.348119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418748.487920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418748.628668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418748.759799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418748.897642]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418749.036679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418749.150299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418749.278791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418749.419186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418749.543180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418749.661245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418749.788575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418749.920824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418750.042439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418750.169496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418750.297261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418750.428541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418750.567873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418750.689664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418750.828313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418750.958407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418751.091257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418751.211394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418751.342294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418751.463708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418751.594494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418751.714318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418751.847717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418751.983753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418752.134152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418752.270541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418752.404168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418752.522794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418752.656133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418752.782563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418752.904415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418753.032214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418753.163125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418753.285158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418753.417023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418753.545521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418753.695120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418753.823647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418753.954244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418754.086036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418754.216379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418754.328115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418754.461659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418754.588958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418754.719757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418754.839088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418754.964941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418755.082890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418755.217084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418755.348345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418755.487881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418755.611834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418755.760161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418755.891906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418756.026318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418756.156828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418756.269074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418756.401086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418756.539499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418756.672937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418756.796877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418756.944524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418757.214586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418757.330628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418757.447874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418757.592842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418757.709028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418757.848629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418757.976300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418758.113726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418758.239391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418758.363970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418758.519209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418758.643152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418758.780627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418758.899985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418759.031657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418759.162148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418759.313738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418759.417518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418759.547898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418759.678651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418759.825125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418759.964583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418760.096745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418760.220804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418760.359674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418760.471890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418760.611706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418760.723197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418760.845632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418760.982692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418761.114461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418761.255836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418761.392742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418761.523415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418761.652242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418761.783122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418761.905133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418762.026732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418762.154309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418762.277833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418762.404080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418762.528012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418762.659633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418762.788107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418762.922215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418763.063488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418763.195550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418763.318385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418763.464830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418763.585834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418763.715474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418763.841733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418763.967013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418764.088788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418764.221316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418764.336709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418764.473081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418764.609657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418764.722682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418764.847966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418764.980236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418765.128021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418765.252402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418765.386195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418765.517782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418765.646508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418765.787542]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418765.906766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418766.032269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418766.178983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418766.311347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418766.426463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418766.573355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418766.700941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418766.831459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418766.961235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418767.090893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418767.234724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418767.350460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418767.473579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418767.626253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418767.739458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418767.879625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418767.997569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418768.149499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418768.271395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418768.400035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418768.526204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418768.659454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418768.785696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418768.919870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418769.025624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418769.152180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418769.299975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418769.420873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418769.554200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418769.691553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418769.837831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418769.967357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418770.091357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418770.216066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418770.338119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418770.469949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418770.595091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418770.731218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418770.851998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418770.982914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418771.104148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418771.253504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418771.371544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418771.528714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418771.656376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418771.795845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418771.926908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418772.078991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418772.194092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418772.341546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418772.469474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418772.584502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418772.717659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418772.851630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418772.980128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418773.112297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418773.241415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418773.383466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418773.505144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418773.650446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418773.778609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418773.903459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418774.022059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418774.158771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418774.274345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418774.418621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418774.529029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418774.659981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418774.791293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418774.945004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418775.065045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418775.199268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418775.334028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418775.465206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418775.589213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418775.719717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418775.840607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418775.983603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418776.091349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418776.236727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418776.343431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418776.481934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418776.609884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418776.750276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418776.882710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418777.010069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418777.138888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418777.268052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418777.388560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418777.528594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418777.649600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418777.785184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418777.934501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418778.080780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418778.210488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418778.343984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418778.463270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418778.588945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418778.711562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418778.841764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418778.966253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418779.109349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418779.221509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418779.368128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418779.482878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418779.619568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418779.752112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418779.895754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418780.059866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418780.190173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418780.318314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418780.461416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418780.580039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418780.735109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418780.853506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418780.984703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418781.114025]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418781.258159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418781.385515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418781.522760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418781.663137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418781.779126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418781.935775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418782.068608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418782.208621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418782.342938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418782.468408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418782.589165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418782.711868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418782.858445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418782.970662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418783.103902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418783.226476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418783.363340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418783.492357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418783.648015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418783.777713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418783.922382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418784.045412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418784.185463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418784.320667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418784.454677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418784.575490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418784.703344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418784.838145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418784.972675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418785.099420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418785.232433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418785.360946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418785.506879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418785.645792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418785.769880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418785.886624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418786.032784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418786.149676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418786.280681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418786.402462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418786.529294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418786.657685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418786.796641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418786.922870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418787.051260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418787.177360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418787.319762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418787.448093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418787.590624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418787.708590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418787.839949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418787.976554]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418788.112507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418788.223346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418788.359509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418788.501069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418788.649042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418788.774421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418788.903695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418789.018450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418789.151558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418789.272524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418789.405049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418789.525090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418789.647958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418789.778461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418789.926608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418790.054265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418790.206562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418790.327674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418790.472110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418790.609463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418790.728271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418790.853671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418791.002066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418791.131775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418791.260058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418791.394843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418791.534696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418791.644782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418791.783003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418791.906947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418792.034462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418792.164517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418792.333403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418792.466656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418792.625573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418792.836798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418793.061514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418793.257576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418793.400664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418793.509636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418793.643978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418793.769019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418793.898815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418794.026251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418794.165854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418794.280639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418794.412711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418794.534528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418794.684464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418794.814762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418794.958618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418795.085761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418795.212961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418795.335118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418795.466841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418795.589453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418795.715065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418795.842651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418795.991844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418796.138330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418796.278880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418796.394482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418796.524801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418796.652408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418796.780977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418796.906685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418797.043788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418797.187276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418797.298913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418797.426948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418797.602793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418797.710075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418797.833306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418797.964860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418798.094064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418798.235235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418798.383009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418798.496665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418798.634818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418798.769158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418798.902986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418799.031180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418799.157940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418799.283159]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418799.430093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418799.568584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418799.684461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418799.821316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418799.949017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418800.081308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418800.231197]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418800.332764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418800.464445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418800.585272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418800.715384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418800.837975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418800.969730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418801.093050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418801.229280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418801.348473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418801.481625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418801.607761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418801.747486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418801.899065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418802.030623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418802.150028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418802.286068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418802.408660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418802.542731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418802.667792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418802.800439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418802.941357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418803.072795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418803.198201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418803.329651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418803.452353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418803.588180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418803.700943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418803.837992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418803.962269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418804.091534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418804.211491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418804.341028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418804.465231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418804.605837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418804.714616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418804.854260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418804.979751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418805.152776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418805.376276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418805.510449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418805.637674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418805.766539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418805.905609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418806.021913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418806.149632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418806.277100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418806.409850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418806.543092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418806.676675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418806.805215]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418806.957754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418807.087241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418807.215983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418807.331575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418807.465446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418807.588447]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418807.741427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418807.848270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418807.975431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418808.104889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418808.248568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418808.378052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418808.529858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418808.642706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418808.774733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418808.898798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418809.045516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418809.169513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418809.284901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418809.418116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418809.553631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418809.681349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418809.821085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418809.948253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418810.078952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418810.211944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418810.332393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418810.456749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418810.583581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418810.731093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418810.859751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418810.968742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418811.098723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418811.229427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418811.366781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418811.500819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418811.651826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418811.775942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418811.901907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418812.069249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418812.193580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418812.327985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418812.460153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418812.587829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418812.719065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418812.852274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418812.985704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418813.123756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418813.274393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418813.402953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418813.528833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418813.663311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418813.790637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418813.933077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418814.091129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418814.205896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418814.328589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418814.461598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418814.589687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418814.714091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418814.858367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418814.967013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418815.093612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418815.220389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418815.362349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418815.471119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418815.593088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418815.731985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418815.856161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418815.984587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418816.117684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418816.254169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418816.395354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418816.519540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418816.650598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418816.776183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418816.904037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418817.037884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418817.177926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418817.296190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418817.429555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418817.568362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418817.704315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418817.826839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418817.955454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418818.106463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418818.235985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418818.361211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418818.496221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418818.630720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418818.752680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418818.892848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418819.026942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418819.146964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418819.278183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418819.396781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418819.535130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418819.659195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418819.788836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418819.925943]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418820.066419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418820.191437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418820.336439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418820.455132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418820.578074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418820.709852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418820.839338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418820.961477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418821.084974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418821.223044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418821.358768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418821.474655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418821.616013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418821.750679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418821.879529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418822.012557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418822.148134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418822.276772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418822.411163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418822.536259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418822.668080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418822.806631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418822.944319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418823.072768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418823.205999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418823.334854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418823.469332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418823.599404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418823.718508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418823.886269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418824.045156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418824.197106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418824.334855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418824.469002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418824.661914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418824.919610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418825.309784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418825.570224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418825.847342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418826.084882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418826.310604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418826.471623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418826.646644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418826.792009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418826.942693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418827.096765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418827.253206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418827.418402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418827.565652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418827.705028]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418827.844244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418828.030143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418828.357737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418828.696030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418828.925446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418829.233057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418829.598594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418829.857895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418830.167319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418830.352849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418830.551646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418830.778428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418830.985580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418831.221723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418831.475570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418831.702627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418831.846365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418832.035326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418832.174304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418832.404212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418832.536033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418832.711176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418832.898838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418833.070553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418833.217132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418833.381794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418833.541802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418833.715066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418833.856188]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418834.047506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418834.233938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418834.384490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418834.552699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418834.730573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418834.903081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418835.112030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418835.239114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418835.431664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418835.595369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418835.772384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418835.920158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418836.092327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418836.253722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418836.418657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418836.611710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418836.794031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418836.937341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418837.109314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418837.280176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418837.445897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418837.602558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418837.793475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418837.964260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418838.111935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418838.283851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418838.461764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418838.631072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418838.793286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418838.956161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418839.140273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418839.294596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418839.478047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418839.648284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418839.815263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418839.976935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418840.158259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418840.316268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418840.476961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418840.650216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418840.815152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418840.988142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418841.153358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418841.315126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418841.530274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418841.658528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418841.816634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418842.033198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418842.196125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418842.402986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418842.547713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418842.713084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418842.868331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418843.042374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418843.215942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418843.360916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418843.517807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418843.680849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418843.876036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418844.042342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418844.206281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418844.369597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418844.532185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418844.707057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418844.855933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418845.028990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418845.228145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418845.358984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418845.520742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418845.686409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418845.835576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418846.001590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418846.169444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418846.327375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418846.473091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418846.656634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418846.809470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418847.006897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418847.176142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418847.346904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418847.499131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418847.756218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418848.004993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418848.167708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418848.340719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418848.472187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418848.651181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418848.919241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418849.089938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418849.346655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418849.626664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418849.877015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418850.065320]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418850.222312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418850.425325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418850.585334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418850.722311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418850.902677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418851.082536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418851.223223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418851.415433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418851.581149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418851.752842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418851.938388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418852.108970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418852.288831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418852.439397]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418852.602664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418852.805935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418852.935016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418853.114594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418853.285822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418853.467963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418853.607074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418853.782743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418853.946476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418854.139916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418854.289566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418854.460364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418854.611685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418854.783308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418854.925231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418855.075543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418855.227695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418855.414810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418855.575198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418855.770654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418855.923882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418856.135440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418856.293608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418856.460108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418856.611210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418856.790610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418856.946379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418857.111953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418857.278961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418857.459514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418857.599151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418857.814268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418857.941443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418858.108948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418858.274983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418858.469893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418858.606110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418858.799027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418858.942235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418859.104283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418859.282213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418859.444900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418859.580766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418859.741205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418859.925034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418860.075166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418860.222111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418860.420935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418860.567886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418860.722614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418860.877831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418861.050002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418861.201205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418861.391779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418861.544745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418861.722303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418861.900968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418862.065731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418862.229251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418862.402252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418862.543128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418862.728512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418862.885427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418863.088375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418863.219119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418863.388437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418863.539602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418863.713285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418863.888550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418864.040926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418864.209052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418864.377567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418864.544237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418864.721883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418864.873466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418865.032027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418865.194991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418865.356252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418865.554778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418865.705169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418865.879122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418866.028486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418866.211224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418866.351471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418866.522982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418866.685338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418866.842095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418867.025890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418867.174428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418867.356384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418867.531086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418867.670461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418867.849131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418868.016716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418868.172466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418868.353688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418868.522487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418868.728878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418868.852675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418869.021808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418869.189181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418869.355452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418869.527694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418869.690690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418869.840220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418870.040601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418870.200643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418870.388464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418870.557052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418870.732924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418870.862209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418871.028586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418871.217123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418871.399790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418871.544142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418871.732292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418871.861595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418872.080966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418872.252913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418872.422339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418872.591702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418872.752199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418872.923518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418873.092038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418873.229614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418873.413443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418873.590201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418873.733996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418873.924884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418874.098050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418874.268095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418874.444094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418874.596500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418874.785288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418874.917322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418875.091901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418875.244270]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418875.419820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418875.586891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418875.752100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418875.908081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418876.064391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418876.219298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418876.400640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418876.557556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418876.712673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418876.880959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418877.060076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418877.193713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418877.358067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418877.525562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418877.693558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418877.847491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418878.004119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418878.159342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418878.330065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418878.472146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418878.648058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418878.805923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418878.979232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418879.149044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418879.319563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418879.486715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418879.659795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418879.819051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418879.981503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418880.141351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418880.314345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418880.467420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418880.640435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418880.817602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418880.985094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418881.132780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418881.315319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418881.477349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418881.654812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418881.780131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418881.949158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418882.110099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418882.293850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418882.439203]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418882.600893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418882.763208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418882.908832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418883.104047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418883.256418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418883.421900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418883.566410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418883.711526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418883.905505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418884.056748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418884.246237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418884.378981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418884.536101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418884.692074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418884.874545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418885.035243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418885.192110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418885.337730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418885.531085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418885.689095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418885.844975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418885.992363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418886.166345]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418886.500169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418886.801056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418887.317576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418887.747438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418888.089493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418888.473695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418888.905853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418889.321076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418889.479960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418889.668414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418889.913409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418890.108587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418890.356498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418890.570053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418890.855790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418891.102838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418891.334379]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418891.531062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418891.853479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418892.093217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418892.415515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418892.604733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418892.875095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418893.043847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418893.333578]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418893.578004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418893.857448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418894.104847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418894.322851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418894.581722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418894.860754]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418895.132676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418895.332361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418895.607560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418895.759419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418895.955287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418896.169619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418896.436803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418896.798662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418897.085018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418897.332084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418897.520107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418897.821166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418897.997716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418898.218857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418898.455116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418898.706232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418899.099898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418899.440338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418899.682318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418899.907964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418900.470127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418900.555988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418900.668929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418900.770833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418900.944944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418901.267228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418901.443206]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418901.724594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418901.936177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418902.167458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418902.463166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418902.750906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418902.943907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418903.182633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418903.392419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418903.658897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418903.943645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418904.182794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418904.442842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418904.660618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418904.907468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418905.143829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418905.392813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418905.618586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418905.855710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418906.104577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418906.307566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418906.573102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418906.932710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418907.205717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418907.476824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418907.919274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418908.102318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418908.445730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418908.846950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418909.097115]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418909.231787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418909.444396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418909.588732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418909.722482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418909.856271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418910.015677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418910.130492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418910.316462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418910.526141]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418910.645100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418910.772337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418910.900129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418911.020465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418911.166330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418911.275731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418911.405765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418911.533296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418911.657168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418911.800151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418911.913744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418912.063892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418912.189094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418912.341765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418912.455950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418912.575902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418912.702511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418912.847258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418912.958368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418913.079415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418913.204984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418913.341604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418913.466851]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418913.594753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418913.727212]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418913.856808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418913.992622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418914.123348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418914.260815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418914.406887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418914.524400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418914.654181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418914.779035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418914.912499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418915.034832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418915.168473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418915.304137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418915.452446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418915.597528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418915.727467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418915.876332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418916.020552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418916.153993]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418916.288374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418916.419876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418916.563676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418916.690915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418916.816485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418916.949859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418917.102302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418917.205184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418917.355409]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418917.452138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418917.582171]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418917.720078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418917.852729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418917.982469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418918.123040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418918.252224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418918.390282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418918.514484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418918.652491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418918.773731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418918.920610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418919.029286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418919.169865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418919.290760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418919.439477]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418919.559783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418919.686925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418919.827120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418919.957923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418920.084177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418920.213235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418920.340647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418920.469255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418920.613690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418920.753078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418920.855662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418920.997957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418921.138228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418921.276204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418921.398702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418921.521023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418921.651536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418921.784555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418921.922837]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418922.068785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418922.188246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418922.308973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418922.451239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418922.586773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418922.708922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418922.842410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418922.962161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418923.091312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418923.226368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418923.332914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418923.460758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418923.591106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418923.717653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418923.855077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418923.997701]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418924.108863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418924.251065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418924.377473]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418924.511325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418924.639063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418924.766550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418924.895429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418925.036922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418925.162686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418925.273435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418925.409532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418925.529688]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418925.673734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418925.799687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418925.926458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418926.057992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418926.212823]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418926.339096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418926.491174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418926.605027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418926.779005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418926.937807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418927.085733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418927.220122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418927.373232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418927.519976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418927.694974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418927.957634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418928.149592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418928.369467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418928.549601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418928.713730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418928.831449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418928.967457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418929.092980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418929.220999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418929.363927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418929.495731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418929.642600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418929.763720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418929.893705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418930.030866]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418930.157052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418930.292289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418930.418119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418930.544681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418930.692132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418930.826241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418930.959419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418931.087489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418931.214555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418931.353459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418931.483518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418931.627930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418931.773601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418931.908884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418932.030217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418932.211303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418932.338638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418932.481201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418932.757830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418933.044101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418933.213731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418933.352420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418933.483356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418933.651625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418933.759423]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418933.906615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418934.028563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418934.157928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418934.284451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418934.436923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418934.565336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418934.689462]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418934.816961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418934.951519]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418935.076054]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418935.206164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418935.339168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418935.457012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418935.587693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418935.728937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418935.899559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418936.037599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418936.176730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418936.335063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418936.477587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418936.625156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418936.802224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418936.958611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418937.095846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418937.248438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418937.389305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418937.522727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418937.792940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418938.102505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418938.224780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418938.356801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418938.503108]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418938.675339]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418938.896258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418939.106210]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418939.291002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418939.477975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418939.650877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418939.894213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418940.109123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418940.247722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418940.396540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418940.680529]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418940.979308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418941.323241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418941.582654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418941.831699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418942.068476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418942.227863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418942.461242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418942.658244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418942.873586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418943.059709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418943.260237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418943.417022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418943.581275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418943.729293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418943.904335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418944.073243]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418944.222213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418944.397868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418944.579440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418944.727576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418944.906772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418945.070972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418945.231717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418945.398393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418945.573341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418945.723900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418945.904480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418946.072428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418946.253593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418946.402752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418946.605507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418946.783298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418947.111930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418947.296483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418947.577913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418947.780265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418947.988174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418948.213359]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418948.372537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418948.560856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418948.724662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418948.908357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418949.094691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418949.295298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418949.474036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418949.633403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418949.812017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418949.996216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418950.170964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418950.413177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418950.674652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418950.837230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418951.087410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418951.223252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418951.416634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418951.605699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418951.791369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418951.960109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418952.165796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418952.456325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418952.804124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418953.077443]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418953.440854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418953.646038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418953.886655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418954.281304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418954.564101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418954.788776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418955.094869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418955.417023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418955.652078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418955.922118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418956.274441]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418956.521591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418956.842637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418957.182691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418957.456174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418957.722994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418957.972912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418958.158052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418958.450623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418958.726852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418959.027934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418959.274063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418959.452061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418959.751745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418959.979732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418960.274599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418960.558700]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418960.902736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418961.085221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418961.299431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418961.497195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418961.875291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418962.104594]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418962.351517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418962.616761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418962.852087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418963.212131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418963.416698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418963.711042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418963.977085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418964.168791]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418964.438648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418964.791709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418965.079131]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418965.415984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418965.730266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418965.978735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418966.281064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418966.544868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418966.793164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418967.043718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418967.227198]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418967.502094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418967.755323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418968.101575]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418968.398269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418968.595731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418968.899704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418969.130893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418969.415064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418969.668031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418969.906301]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418970.068416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418970.277234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418970.466955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418970.684695]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418970.860452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418971.067994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418971.216879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418971.415571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418971.532581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418971.711544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418971.856567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418972.058673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418972.221240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418972.375395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418972.531772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418972.699036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418972.845248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418973.034722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418973.170166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418973.339886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418973.505293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418973.688250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418973.829406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418974.026897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418974.313975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418974.636063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418974.812088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418974.975902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418975.146559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418975.311123]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418975.467977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418975.679107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418975.793517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418976.038030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418976.310601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418976.531776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418976.714013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418976.877607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418977.040431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418977.213037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418977.396699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418977.574255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418977.812797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418977.964030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418978.147027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418978.323177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418978.485496]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418978.671947]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418978.813683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418978.994585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418979.178741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418979.338920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418979.517118]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418979.688014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418979.840562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418980.025336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418980.192954]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418980.337031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418980.501489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418980.658457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418980.836087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418980.997604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418981.167952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418981.362392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418981.535524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418981.668669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418981.867894]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418982.040972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418982.246659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418982.410093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418982.577745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418982.764996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418982.960250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418983.099255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418983.279876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418983.467470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418983.774933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418984.082155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418984.402694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418984.663048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418984.848734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418985.104100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418985.306498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418985.618937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418985.842031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418986.098208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418986.446418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418986.729474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418987.011092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418987.336249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418987.632596]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418987.933977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418988.263651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418988.611464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418988.794533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418989.003416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418989.233276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418989.417630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418989.608530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418989.853032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418990.036708]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418990.298319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418990.457314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418990.629167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418990.786535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418990.965406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418991.132627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418991.303389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418991.677994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418992.014968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418992.468729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418992.717686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418993.079055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418993.346844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418993.642769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418993.910793]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418994.228860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418994.411272]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418994.665135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418994.943317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638418995.265297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418995.465654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418995.716006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418995.878533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418996.056361]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418996.234455]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418996.413800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418996.597242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418996.775468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418996.938909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418997.134392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418997.301969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418997.496654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418997.628095]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418997.791521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418997.964086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418998.120291]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418998.281266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418998.472199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418998.592853]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418998.773487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418998.919283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418999.093178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418999.249351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418999.420557]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418999.543005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418999.713466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638418999.868628]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419000.058341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419000.202872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419000.354768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419000.510792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419000.711382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419000.834367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419000.997971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419001.146125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419001.312545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419001.594468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419001.912814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419002.194606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419002.544671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419002.850266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419003.092555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419003.389724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419003.584863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419003.754269]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419003.955314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419004.334620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419004.796358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419005.116826]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419005.355138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419005.563261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419005.754726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419005.910249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419006.211742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419006.440660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419006.711693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419006.897372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419007.186995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419007.341653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419007.515684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419007.678110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419007.853526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419007.972227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419008.149724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419008.302348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419008.477685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419008.657620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419008.822644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419008.974686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419009.188568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419009.344481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419009.544952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419009.696216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419009.996613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419010.221260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419010.383678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419010.578228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419010.771076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419011.021915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419011.189364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419011.374565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419011.523538]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419011.743996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419012.038308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419012.192859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419012.392143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419012.592854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419012.780890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419012.919541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419013.209792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419013.431722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419013.800994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419014.040008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419014.265052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419014.452777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419014.648896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419014.791857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419014.956261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419015.119780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419015.313778]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419015.487808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419015.637249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419015.779285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419015.948493]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419016.109432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419016.283783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419016.449237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419016.900595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419017.142429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419017.474394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419017.722864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419017.953657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419018.131929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419018.339153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419018.519686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419018.701050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419018.914939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419019.090363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419019.247779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419019.434845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419019.615221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419019.747713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419019.945900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419020.135933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419020.348390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419020.526692]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419020.655340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419020.834228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419021.018658]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419021.166585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419021.338762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419021.500343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419021.654030]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419021.828665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419022.028670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419022.183938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419022.364535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419022.538153]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419022.730445]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419022.929302]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419023.370971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419023.586959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419023.834375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419024.036719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419024.222151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419024.418846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419024.581732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419024.758913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419024.899486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419025.062522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419025.210241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419025.418057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419025.562266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419025.723787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419025.879392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419026.044264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419026.231189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419026.387124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419026.544850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419026.698001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419026.972994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419027.124328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419027.387727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419027.745585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419028.036574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419028.333870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419028.714569]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419029.043677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419029.390553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419029.624185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419029.987129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419030.273927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419030.536757]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419030.727253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419030.957099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419031.120908]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419031.383970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419031.684681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419032.136195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419032.339087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419032.548803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419032.734265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419032.964586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419033.149268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419033.296147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419033.460343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419033.636221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419033.779685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419033.962869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419034.120049]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419034.295921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419034.469231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419034.608541]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419034.770208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419034.959583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419035.090988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419035.273989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419035.429798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419035.587460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419035.731744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419035.959059]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419036.134766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419036.291503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419036.450785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419036.612931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419036.788986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419037.006463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419037.145249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419037.323537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419037.495812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419037.648956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419037.811034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419038.012415]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419038.141124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419038.321586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419038.478386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419038.655727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419038.818336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419039.021246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419039.165833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419039.324644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419039.465346]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419039.704421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419039.852329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419040.053969]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419040.183306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419040.351955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419040.522032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419040.697351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419040.929624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419041.113146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419041.280808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419041.470606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419041.651789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419041.841779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419042.019828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419042.192744]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419042.384731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419042.538046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419042.715411]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419043.027314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419043.343664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419043.663942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419043.919350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419044.099182]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419044.405351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419044.690282]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419044.997534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419045.276489]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419045.577553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419046.033611]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419046.191485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419046.401459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419046.581776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419046.773352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419046.964166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419047.192985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419047.335710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419047.502604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419047.683154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419047.901429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419048.201083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419048.376143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419048.538421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419048.687454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419048.834323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419049.014705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419049.183775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419049.342400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419049.506659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419049.648433]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419049.828367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419049.990663]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419050.150862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419050.305363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419050.474527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419050.664906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419050.875136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419051.191960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419051.464192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419051.666199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419051.914904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419052.161922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419052.354427]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419052.529550]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419052.721296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419052.875539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419053.037551]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419053.209271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419053.353048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419053.596015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419053.852559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419054.108274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419054.563602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419054.910792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419055.158644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419055.412276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419055.722539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419056.105014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419056.341535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419056.536734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419056.713094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419056.943549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419057.139384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419057.288039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419057.462275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419057.611476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419057.771571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419057.956257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419058.096581]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419058.300801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419058.603612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419058.886265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419059.175333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419059.510327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419059.697337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419059.904146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419060.095395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419060.286771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419060.475649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419060.655831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419060.838014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419060.999651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419061.200276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419061.346207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419061.581711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419061.832539]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419062.101576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419062.392929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419062.571838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419062.795223]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419062.902600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419063.084660]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419063.229193]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419063.412231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419063.563138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419063.730912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419063.913713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419064.068109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419064.246819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419064.507967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419064.809938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419065.139142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419065.411012]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419065.658632]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419065.937926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419066.189715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419066.327860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419066.473827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419066.649497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419066.829652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419066.986792]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419067.183996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419067.323075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419067.498116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419067.669513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419067.831237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419067.993005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419068.148146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419068.287958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419068.463364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419068.631080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419068.788174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419068.956641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419069.113898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419069.271890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419069.454358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419069.600034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419069.769927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419069.921863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419070.085239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419070.233227]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419070.376163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419070.574393]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419070.722617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419070.898205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419071.039895]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419071.199158]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419071.385972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419071.537912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419071.794294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419071.967974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419072.129750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419072.407838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419072.683466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419073.032968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419073.356789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419073.694498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419074.001984]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419074.273921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419074.455045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419074.653255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419074.825467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419075.016020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419075.240378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419075.394860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419075.546152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419075.714356]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419075.901073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419076.040146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419076.235643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419076.414607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419076.582535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419076.867781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419077.200821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419077.395142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419077.582179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419077.701848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419077.887396]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419078.023014]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419078.206736]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419078.387237]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419078.561856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419078.701707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419078.951662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419079.186654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419079.377970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419079.591491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419079.776474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419079.974039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419080.135889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419080.287619]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419080.490073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419080.843241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419081.151091]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419081.317622]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419081.734709]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419082.073370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419082.396122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419082.787318]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419082.991844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419083.215388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419083.486768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419083.722780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419083.912719]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419084.130717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419084.354431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419084.612497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419085.017920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419085.273577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419085.620615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419085.862639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419086.158518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419086.445580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419086.774021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419087.130388]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419087.402976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419087.652994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419087.951169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419088.440492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419088.620801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419088.906750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419089.211174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419089.393783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419089.713310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419089.972564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419090.149673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419090.350100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419090.722363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419090.972257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419091.187219]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419091.438630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419091.596764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419091.765343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419091.933011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419092.107936]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419092.255737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419092.475360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419092.774453]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419093.142516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419093.392045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419093.680794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419093.962177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419094.155560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419094.356966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419094.570821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419094.811368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419094.975040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419095.145610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419095.289448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419095.513324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419095.807668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419096.090375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419096.416479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419096.685251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419096.944326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419097.352067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419097.645019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419097.805429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419098.005419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419098.159342]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419098.356315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419098.518661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419098.708468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419098.853621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419099.035460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419099.220444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419099.391587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419099.561647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419099.737942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419099.933456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419100.111299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419100.283299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419100.535490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419100.807191]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419101.047827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419101.252527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419101.415020]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419101.664653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419101.987256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419102.241241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419102.488259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419102.701914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419102.962513]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419103.182340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419103.399648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419103.684400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419103.906958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419104.236176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419104.472322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419104.880898]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419105.139395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419105.434325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419105.659647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419105.901623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419106.163605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419106.415650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419106.695362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419106.948074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419107.096634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419107.308189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419107.497882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419107.765110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419107.958515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419108.151195]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419108.343555]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419108.586166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419108.777218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419109.013056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419109.265877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419109.537713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419109.906648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419110.153238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419110.398015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419110.672907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419110.914392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419111.105231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419111.362812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419111.641046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419111.945425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419112.178850]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419112.426961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419112.761848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419113.008222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419113.311537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419113.700666]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419114.004390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419114.193190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419114.497075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419114.710855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419114.910767]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419115.156015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419115.318402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419115.707177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419115.912010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419116.086351]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419116.343234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419116.667872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419116.874782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419117.073354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419117.388034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419117.707362]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419118.088220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419118.469680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419118.848923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419119.042737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419119.497341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419119.807015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419120.126119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419120.468050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419120.755173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419121.000771]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419121.644724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419122.026184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419122.390152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419122.599424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419122.845925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419123.103310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419123.425316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419123.680465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419124.037976]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419124.311505]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419124.454998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419124.674469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419124.872389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419125.080472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419125.317187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419125.723107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419126.080676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419126.308745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419126.604261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419126.887727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419127.143016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419127.498050]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419127.615418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419127.903706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419128.120906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419128.463848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419128.722495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419128.906982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419129.215952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419129.621974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419129.789669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419130.023335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419130.243809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419130.649812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419131.048377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419131.555829]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419132.111471]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419132.449951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419132.853753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419133.391584]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419133.683104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419134.110677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419134.580244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419134.845113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419135.086509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419135.345112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419135.600527]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419135.852525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419136.162381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419136.535341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419136.858998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419137.197682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419137.468500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419137.813687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419138.228972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419138.581620]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419138.838599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419139.087687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419139.330630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419139.570065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419139.851107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419140.059566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419140.214786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419140.523930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419140.871180]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419141.267606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419141.518008]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419141.771072]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419142.026845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419142.268222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419142.581721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419142.923855]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419143.281610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419143.597154]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419143.839063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419144.136922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419144.354690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419144.659809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419144.917294]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419145.164208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419145.425031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419145.701849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419146.056789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419146.316484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419146.625606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419146.961172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419147.218204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419147.512646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419147.866694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419148.149113]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419148.435777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419148.830333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419149.140221]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419149.412446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419149.655571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419149.835972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419150.059783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419150.213189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419150.390992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419150.559226]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419150.736334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419150.850235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419151.021457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419151.181647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419151.435951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419151.706421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419152.009494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419152.337933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419152.586022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419152.782998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419153.032899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419153.267313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419153.467211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419153.700010]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419153.843588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419154.061374]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419154.201566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419154.382390]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419154.537661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419154.712249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419154.899591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419155.137047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419155.311890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419155.671780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419155.956530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419156.157755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419156.383640]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419156.552316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419156.835472]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419156.970145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419157.148803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419157.304232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419157.510027]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419157.666487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419157.867298]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419158.023818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419158.217890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419158.400077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419158.617831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419158.832125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419159.015637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419159.179857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419159.323574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419159.494363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419159.647552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419159.837623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419160.019633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419160.201031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419160.337071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419160.512633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419160.675035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419160.871419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419161.037683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419161.200431]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419161.371391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419161.550481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419161.698650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419161.858161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419162.062463]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419162.223485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419162.395211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419162.557820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419162.718804]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419162.891406]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419163.053143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419163.229040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419163.389454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419163.561671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419163.721882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419163.908491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419164.030799]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419164.221350]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419164.393309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419164.582280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419164.755340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419164.931482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419165.075600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419165.251953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419165.400679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419165.611430]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419165.725357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419166.033693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419166.289725]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419166.558454]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419166.910918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419167.159517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419167.339412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419167.649982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419167.847654]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419168.122731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419168.509234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419168.782562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419169.033335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419169.263110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419169.587479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419169.783960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419170.133749]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419170.410382]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419170.589710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419170.822922]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419171.083573]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419171.455612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419171.757601]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419172.021166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419172.264228]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419172.471478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419172.772705]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419173.072058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419173.336444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419173.603063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419173.868858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419174.219375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419174.468084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419174.654685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419174.993552]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419175.242782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419175.511225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419175.762104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419176.097132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419176.409422]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419176.657001]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419176.855469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419177.173565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419177.495517]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419177.718644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419177.911563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419178.282357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419178.839074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419179.115854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419179.410358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419179.704674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419179.995563]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419180.339184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419180.523960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419180.844602]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419181.185516]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419181.424546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419181.726218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419182.011482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419182.382794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419182.718092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419183.038836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419183.292784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419183.566347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419183.775730]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419184.038432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419184.263117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419184.520721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419184.833017]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419185.091213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419185.352500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419185.658970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419185.901861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419186.087901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419186.330039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419186.550689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419186.851087]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419187.143347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419187.412655]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419187.682391]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419187.957241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419188.272677]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419188.634884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419188.900344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419189.241133]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419189.519277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419189.770173]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419190.147858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419190.429132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419190.699664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419190.962229]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419191.322039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419191.594923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419191.809784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419192.155363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419192.434659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419192.701120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419192.988200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419193.185327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419193.468975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419193.780065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419194.092924]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419194.396470]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419194.568860]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419194.850838]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419195.183819]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419195.454328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419195.816354]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419196.081706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419196.306906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419196.592944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419196.784031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419197.080656]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419197.389712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419197.599485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419197.902178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419198.190941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419198.582142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419198.859155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419199.048224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419199.369942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419199.580190]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419199.830004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419200.115211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419200.382304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419200.603425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419200.809849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419201.118357]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419201.415152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419201.654684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419201.948707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419202.234169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419202.548676]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419202.801847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419203.101327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419203.368859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419203.635252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419203.923511]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419204.185135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419204.511466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419204.732166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419205.049896]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419205.323336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419205.597765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419205.863962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419206.125953]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419206.410515]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419206.609448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419206.862867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419207.131973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419207.407906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419207.682251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419207.992592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419208.310691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419208.430234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419208.684217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419209.024306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419209.198769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419209.449888]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419209.651247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419209.914175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419210.183558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419210.551065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419210.825373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419211.107199]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419211.324854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419211.620419]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419211.957280]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419212.136772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419212.387760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419212.676887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419212.982143]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419213.315871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419213.609341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419213.897909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419214.146021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419214.455100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419214.689174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419214.909716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419215.201416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419215.520907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419215.817110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419215.999874]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419216.290537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419216.497805]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419216.800488]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419216.970085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419217.254328]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419217.524334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419217.807698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419218.073696]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419218.318844]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419218.629105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419218.951902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419219.263500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419219.522824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419219.871785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419220.061021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419220.282053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419220.669566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419220.828589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419221.085437]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419221.396288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419221.654845]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419221.912460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419222.231329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419222.437207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419222.743528]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419222.987904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419223.237459]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419223.544208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419223.773597]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419224.074070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419224.365731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419224.645797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419224.953586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419225.209711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419225.486691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419225.701482]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419226.009079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419226.281890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419226.560481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419226.783501]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419227.062945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419227.232769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419227.488787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419227.804201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419228.043160]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419228.373534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419228.667876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419228.950127]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419229.304481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419229.492883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419229.800779]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419229.969616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419230.318994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419230.573919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419230.767988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419231.096385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419231.397283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419231.637768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419231.859707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419232.201309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419232.537566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419232.837818]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419233.101305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419233.371268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419233.595775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419233.868751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419234.078152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419234.281810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419234.504299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419234.782967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419235.133061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419235.365678]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419235.609806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419235.844863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419236.082126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419236.294053]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419236.574225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419236.877002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419237.156647]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419237.360683]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419237.701448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419238.017082]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419238.265973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419238.634457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419238.796104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419239.023618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419239.271667]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419239.586614]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419239.884876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419240.073735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419240.282636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419240.523211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419240.769090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419240.957522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419241.246606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419241.574019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419241.832831]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419242.034834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419242.384401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419242.773577]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419242.990065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419243.296322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419243.656997]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419243.890034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419244.200618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419244.468125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419244.650364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419244.964175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419245.221296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419245.568184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419245.818303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419246.080808]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419246.339452]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419246.652630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419246.905814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419247.235450]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419247.466326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419247.713777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419247.974549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419248.244335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419248.548466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419248.883932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419249.180811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419249.431161]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419249.701962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419249.965787]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419250.258773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419250.513451]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419250.792759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419251.090558]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419251.429694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419251.676931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419251.994605]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419252.286999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419252.612674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419252.859077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419253.208518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419253.405618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419253.691329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419253.951416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419254.302882]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419254.463963]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419254.780780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419255.000416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419255.284996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419255.710211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419255.894885]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419256.117592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419256.390487]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419256.755859]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419256.907102]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419257.180147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419257.460534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419257.759876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419258.022745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419258.340126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419258.640999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419258.815649]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419259.152607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419259.379815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419259.678981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419259.896385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419260.262879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419260.485974]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419260.704295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419260.953331]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419261.220504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419261.391166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419261.634119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419261.864931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419262.101337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419262.323037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419262.591389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419262.779852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419263.022869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419263.340378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419263.457747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419263.714914]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419263.986372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419264.203706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419264.442609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419264.691326]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419264.948335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419265.137905]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419265.376901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419265.548994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419265.804738]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419266.057440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419266.366365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419266.551434]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419266.772583]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419266.990543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419267.256781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419267.520007]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419267.792247]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419268.022165]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419268.261574]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419268.530169]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419268.856633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419269.140292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419269.316848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419269.548668]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419269.832111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419270.069883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419270.393809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419270.571694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419270.868928]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419271.124828]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419271.397037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419271.680613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419272.016634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419272.205958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419272.522045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419272.771856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419273.108032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419273.391432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419273.592827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419273.839440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419274.124457]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419274.394679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419274.708316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419274.971893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419275.250304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419275.488183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419275.802015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419276.084200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419276.273267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419276.507915]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419276.781314]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419277.050168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419277.243712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419277.537310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419277.819064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419278.081883]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419278.321401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419278.528776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419278.778909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419279.080179]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419279.268525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419279.566956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419279.821592]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419280.100046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419280.317868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419280.623507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419280.942323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419281.196293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419281.466783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419281.733653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419281.991580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419282.250560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419282.494013]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419282.796803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419283.044553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419283.293926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419283.544680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419283.784773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419284.097353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419284.428698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419284.785884]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419285.021764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419285.302618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419285.555139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419285.841005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419286.091944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419286.385081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419286.640077]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419286.995438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419287.431429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419287.709205]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419288.019436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419288.287752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419288.644202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419289.018537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419289.305084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419289.553486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419289.822106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419290.133732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419290.422031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419290.675741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419290.935713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419291.195985]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419291.487798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419291.698931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419292.028475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419292.299344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419292.575504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419292.891251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419293.179543]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419293.402565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419293.654932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419294.033503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419294.320813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419294.570004]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419294.821616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419295.110827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419295.438073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419295.685680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419295.900421]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419296.151533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419296.373880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419296.654186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419296.875992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419297.201982]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419297.547258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419297.779063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419297.991044]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419298.255355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419298.510652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419298.741325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419298.970265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419299.319055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419299.600242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419299.888798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419300.148861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419300.392547]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419300.623520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419300.953464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419301.126152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419301.449255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419301.718880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419301.958152]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419302.250015]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419302.593137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419302.857751]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419303.135277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419303.416740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419303.702684]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419303.892633]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419304.202185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419304.481336]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419304.799986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419305.010856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419305.361167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419305.635363]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419305.956031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419306.253064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419306.505788]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419306.779537]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419307.151214]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419307.460745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419307.657248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419307.926341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419308.245209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419308.510720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419308.662435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419308.956315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419309.268785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419309.574703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419309.767902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419310.092137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419310.428258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419310.693330]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419310.953448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419311.279635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419311.504402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419311.840623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419312.074128]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419312.271355]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419312.559281]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419312.753636]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419313.089499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419313.339293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419313.659764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419313.896892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419314.158135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419314.393629]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419314.653523]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419314.842140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419315.137288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419315.471403]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419315.722251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419315.956606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419316.234484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419316.439623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419316.827075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419317.121691]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419317.319335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419317.528106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419317.829175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419318.127868]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419318.435394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419318.775460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419319.111755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419319.396147]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419319.641593]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419319.954991]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419320.181535]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419320.423949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419320.655795]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419320.922522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419321.241295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419321.501913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419321.779786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419322.079630]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419322.342987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419322.605559]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419322.933769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419323.201989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419323.402643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419323.714126]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419323.956319]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419324.365040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419324.562125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419324.875566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419325.174861]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419325.465669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419325.711625]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419326.034849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419326.214481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419326.574714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419326.843665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419327.147892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419327.452216]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419327.672794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419327.946892]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419328.205322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419328.485265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419328.705140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419328.983366]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419329.269114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419329.567765]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419329.818743]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419330.111063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419330.391104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419330.678271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419330.941675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419331.247763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419331.406332]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419331.703962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419332.038222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419332.175048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419332.522531]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419332.655037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419333.018163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419333.285224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419333.614365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419333.892404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419334.179685]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419334.378721]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419334.621712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419334.938207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419335.159084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419335.397046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419335.764401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419336.086864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419336.375315]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419336.630144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419336.961273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419337.295802]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419337.618186]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419338.033061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419338.309988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419338.518762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419338.746863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419339.061277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419339.237825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419339.444728]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419339.673324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419339.831562]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419340.024420]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419340.198117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419340.360576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419340.542268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419340.703168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419340.839748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419341.007704]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419341.153349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419341.337036]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419341.466789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419341.638448]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419341.778375]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419341.944248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419342.099394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419342.284687]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419342.432999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419342.592879]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419342.752566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419342.921175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419343.079504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419343.238321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419343.392235]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419343.534965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419343.716436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419343.865564]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419344.011873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419344.192061]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419344.338137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419344.527907]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419344.681358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419344.828848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419344.979048]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419345.138568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419345.290297]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419345.466699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419345.648942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419345.784560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419345.948483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419346.108038]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419346.260937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419346.447313]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419346.580340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419346.737724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419346.892679]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419347.060690]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419347.239271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419347.379672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419347.528901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419347.703211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419347.855815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419348.029608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419348.183187]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419348.342665]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419348.508062]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419348.662821]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419348.853798]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419349.017360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419349.153424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419349.315040]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419349.504088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419349.662495]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419349.806827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419349.985268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419350.115242]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419350.277536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419350.438185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419350.628092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419350.770177]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419350.908876]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419351.070436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419351.232755]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419351.386145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419351.560920]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419351.712524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419351.883950]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419352.061132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419352.261011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419352.377085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419352.541641]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419352.699591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419352.862327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419353.016278]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419353.188250]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419353.330723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419353.500364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419353.708833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419353.846872]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419354.032873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419354.193468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419354.372416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419354.524846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419354.705992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419354.850672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419355.023208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419355.161664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419355.328240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419355.487213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419355.646809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419355.800338]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419356.013306]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419356.129414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419356.326776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419356.463852]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419356.626822]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419356.769042]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419356.948983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419357.091083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419357.280759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419357.414410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419357.593183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419357.737702]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419357.919981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419358.067236]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419358.233735]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419358.390340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419358.563074]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419358.703681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419358.878365]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419359.011909]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419359.189248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419359.325585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419359.495570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419359.666485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419359.835986]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419360.015327]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419360.174347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419360.332711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419360.501003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419360.675760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419360.839820]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419360.992026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419361.171416]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419361.308810]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419361.474324]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419361.636168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419361.801003]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419361.964918]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419362.126651]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419362.277312]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419362.447146]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419362.621904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419362.767809]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419362.922100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419363.084961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419363.263606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419363.419760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419363.596305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419363.743843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419363.894546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419364.047444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419364.211057]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419364.380507]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419364.570580]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419364.736296]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419364.891464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419365.050776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419365.204468]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419365.364139]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419365.517064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419365.697474]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419365.835870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419366.014018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419366.159307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419366.318417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419366.473814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419366.636056]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419366.783987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419366.958202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419367.109659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419367.267224]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419367.403871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419367.578886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419367.740966]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419367.906039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419368.066781]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419368.234671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419368.387987]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419368.533202]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419368.679089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419368.861137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419369.012568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419369.186347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419369.330112]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419369.499939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419369.643579]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419369.839260]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419369.981274]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419370.142498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419370.316140]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419370.487144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419370.639717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419370.785172]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419370.945259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419371.116440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419371.267467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419371.438742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419371.590711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419371.773891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419371.901532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419372.093070]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419372.234929]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419372.419877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419372.572807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419372.721652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419372.877624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419373.047295]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419373.194714]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419373.382439]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419373.527913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419373.699265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419373.841138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419374.013777]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419374.170842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419374.317857]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419374.465568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419374.644377]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419374.786094]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419374.953561]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419375.104063]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419375.270360]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419375.438999]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419375.625604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419375.755971]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419375.921871]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419376.080930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419376.258813]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419376.379137]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419376.540881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419376.698772]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419376.871078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419377.018862]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419377.191773]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419377.340064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419377.514264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419377.651184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419377.826694]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419377.988089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419378.131026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419378.282568]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419378.466343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419378.628069]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419378.785055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419378.953341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419379.103261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419379.258977]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419379.404913]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419379.566194]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419379.735566]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419379.882246]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419380.081458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419380.237499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419380.400835]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419380.581253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419380.740530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419380.880790]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419381.030435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419381.189231]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419381.378079]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419381.524571]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419381.672598]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419381.837711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419382.016506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419382.157467]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419382.342168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419382.469021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419382.645956]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419382.808671]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419382.977116]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419383.115248]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419383.283762]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419383.462504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419383.622567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419383.759803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419383.961653]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419384.104782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419384.267786]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419384.427664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419384.581672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419384.750381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419384.905099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419385.064244]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419385.242438]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419385.373544]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419385.553078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419385.696553]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419385.864031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419386.026904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419386.285259]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419386.436148]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419386.632367]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419386.760940]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419386.919276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419387.068652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419387.222135]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419387.399340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419387.534083]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419387.692742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419387.869119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419388.031175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419388.200712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419388.350034]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419388.532759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419388.676370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419388.840880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419388.996942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419389.165634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419389.322588]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419389.467890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419389.640185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419389.797952]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419389.951002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419390.119794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419390.258444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419390.439814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419390.611565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419390.774521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419390.941136]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419391.101886]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419391.276935]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419391.444856]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419391.562404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419391.717019]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419391.908376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419392.035081]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419392.204599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419392.380408]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419392.529016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419392.709309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419392.861877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419393.025484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419393.214268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419393.363498]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419393.503011]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419393.677490]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419393.837965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419393.973099]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419394.139207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419394.302058]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419394.453218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419394.613832]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419394.761717]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419394.943652]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419395.111200]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419395.262502]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419395.404849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419395.575526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419395.759334]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419395.924353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419396.082317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419396.230994]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419396.391546]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419396.540399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419396.697925]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419396.860711]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419397.017618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419397.194606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419397.340329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419397.541732]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419397.690267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419397.840307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419398.019021]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419398.191603]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419398.348449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419398.500699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419398.638385]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419398.823657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419398.968234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419399.136988]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419399.299398]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419399.450486]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419399.603449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419399.776090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419399.915941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419400.076979]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419400.245373]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419400.407428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419400.561644]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419400.735002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419400.890120]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419401.058209]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419401.197921]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419401.399890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419401.533322]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419401.705824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419401.881417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419402.055783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419402.219481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419402.400869]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419402.524418]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419402.700508]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419402.857585]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419403.034673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419403.196846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419403.339092]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419403.507937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419403.702627]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419403.838608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419404.014093]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419404.177713]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419404.360761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419404.529902]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419404.675514]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419404.823635]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419404.987122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419405.139664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419405.319241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419405.459961]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419405.629846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419405.786277]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419405.953807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419406.092955]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419406.269045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419406.431255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419406.575176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419406.736130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419406.917485]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419407.065582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419407.259718]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419407.379609]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419407.552018]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419407.705446]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419407.891469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419408.044720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419408.221978]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419408.361369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419408.529783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419408.697046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419408.864526]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419408.995637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419409.151616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419409.338512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419409.489253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419409.646919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419409.798145]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419409.940253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419410.126132]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419410.276376]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419410.440481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419410.580867]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419410.761648]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419410.913576]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419411.086052]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419411.245846]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419411.408500]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419411.576567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419411.759230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419411.916903]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419412.101460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419412.249435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419412.419039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419412.582181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419412.763748]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419412.903285]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419413.035992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419413.204476]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419413.365289]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419413.520125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419413.695400]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419413.870595]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419414.010599]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419414.154273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419414.360234]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419414.491043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419414.681926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419414.863839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419415.108068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419415.294275]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419415.552239]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419415.705506]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419416.055639]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419416.296425]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419416.470417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419416.765151]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419417.002105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419417.211084]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419417.468938]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419417.737998]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419417.882181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419418.074849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419418.202504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419418.377904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419418.534567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419418.720870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419418.839283]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419419.013567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419419.188417]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419419.358865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419419.527716]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419419.646252]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419419.815616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419419.970933]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419420.207624]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419420.313086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419420.510600]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419420.655230]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419420.824192]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419420.963833]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419421.159265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419421.299016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419421.469962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419421.625945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419421.774335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419421.942811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419422.106287]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419422.264763]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419422.436830]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419422.575958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419422.756659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419422.898436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419423.078932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419423.252927]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419423.392534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419423.545664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419423.715075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419423.884737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419424.043033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419424.190241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419424.356503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419424.523273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419424.682046]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419424.828073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419425.010672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419425.181484]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419425.340524]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419425.509843]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419425.708353]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419425.840817]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419426.011536]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419426.187402]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419426.354122]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419426.505043]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419426.670540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419426.827494]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419427.006033]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419427.156204]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419427.341217]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419427.504101]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419427.672864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419427.839481]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419427.998085]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419428.169308]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419428.300875]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419428.448534]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419428.610465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419428.762305]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419428.940758]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419429.087024]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419429.275107]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419429.401650]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419429.658776]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419429.794572]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419429.992358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419430.121887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419430.364672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419430.595681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419430.768392]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419431.043962]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419431.272836]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419431.430029]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419431.583587]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419431.753800]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419431.902109]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419432.090144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419432.264426]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419432.464335]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419432.660980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419432.831612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419432.979491]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419433.136222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419433.299352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419433.456797]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419433.600157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419433.762002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419433.948616]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419434.079981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419434.256659]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419434.415741]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419434.588311]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419434.770699]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419434.917753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419435.104742]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419435.239761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419435.392497]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419435.540858]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419435.712990]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419435.863369]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419436.048323]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419436.213037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419436.330789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419436.505520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419436.671249]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419436.823980]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419436.982134]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419437.152185]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419437.325414]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419437.475088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419437.635106]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419437.809643]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419437.951645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419438.128164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419438.281623]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419438.445722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419438.606814]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419438.798878]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419438.935051]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419439.102168]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419439.257412]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419439.429586]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419439.585026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419439.773726]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419439.953764]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419440.106399]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419440.261996]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419440.426533]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419440.568923]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419440.754842]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419440.888941]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419441.074263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419441.426972]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419441.651512]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419441.835316]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419442.012733]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419442.177002]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419442.355939]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419442.515225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419442.693944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419442.862183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419443.000384]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419443.166257]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419443.327178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419443.498901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419443.639241]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419443.793100]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419443.988436]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419444.148475]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419444.328965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419444.459631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419444.637707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419444.776681]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419444.950429]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419445.120440]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419445.265932]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419445.460125]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419445.583811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419445.776522]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419445.899815]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419446.067201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419446.232727]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419446.389284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419446.571381]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419446.740442]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419446.889156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419447.046591]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419447.366930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419447.527344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419447.816863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419448.113075]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419448.515401]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419448.877174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419449.156729]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419449.548794]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419449.928796]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419450.162901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419450.464449]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419450.808770]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419451.070150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419451.356045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419451.569849]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419451.782368]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419452.132848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419452.431631]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419452.666266]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419452.937181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419453.153238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419453.440873]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419453.657130]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419454.025090]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419454.248167]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419454.529618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419454.778124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419455.019889]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419455.263803]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419455.507891]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419455.710975]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419455.932178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419456.119119]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419456.406937]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419456.618747]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419456.919178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419457.112163]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419457.338183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419457.568389]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419457.798348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419458.040068]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419458.276292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419458.529358]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419458.730288]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419459.069170]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419459.228930]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419459.510310]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419459.749352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419460.004432]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419460.178731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419460.379268]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419460.588784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419460.822208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419461.072086]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419461.280341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419461.627031]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419462.010706]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419462.334841]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419462.582680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419462.767337]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419462.945965]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419463.125606]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419463.333105]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419463.666253]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419463.956096]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419464.154824]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419464.388055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419464.633080]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419464.899370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419465.105752]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419465.400995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419465.635806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419465.864645]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419466.077766]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419466.312703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419466.619983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419466.782801]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419467.082032]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419467.398258]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419467.737348]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419468.027731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419468.317899]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419468.513343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419468.751806]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419469.058919]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419469.217071]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419469.443675]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419469.732466]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419469.979293]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419470.440945]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419470.705760]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419471.061931]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419471.395847]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419471.573341]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419471.789183]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419472.032076]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419472.233372]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419472.415045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419472.623111]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419472.793222]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419472.990208]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419473.155964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419473.337870]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419473.502893]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419473.844968]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419474.000124]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419474.176329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419474.336958]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419474.522590]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419474.651458]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419474.855428]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419475.008343]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419475.156610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419475.375035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419475.566067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419475.731142]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419475.884863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419476.073503]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419476.220525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419476.390211]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419476.563066]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419476.776545]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419477.048589]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419477.312078]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419477.583255]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419477.835273]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419478.056104]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419478.218207]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419478.385479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419478.558720]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419478.737220]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419478.886775]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419479.073067]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419479.245540]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419479.406245]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419479.565088]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419479.740261]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419479.886944]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419480.067951]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419480.205303]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419480.383670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419480.527834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419480.757664]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419481.015703]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419481.309370]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419481.626780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419481.839621]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419482.057880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419482.397549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419482.669037]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419482.951144]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419483.196825]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419483.487352]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419483.718424]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419484.130682]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419484.398089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419484.657064]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419484.855662]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419485.133317]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419485.446949]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419485.691525]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419485.899509]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638419486.237189]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419486.463957]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419486.773710]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419486.995722]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419487.300349]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419487.586880]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638419487.880672]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
shutdown request: [/SEG_Debugger] Reason: new node registered with same name
[DEBUG] [1638419487.978976]: [/image_server/image] failed to receive incoming message : unable to receive data from sender, check sender's logs for details
bridge = CvBridge()
def setup_camera():
    rospy.Subscriber("image_server/image",
            Image, 
            image_callback, 
            queue_size=1
            )
    rospy.loginfo("Camera Online")

    image = Image()
    new_image = True

    canvas = np.zeros((
                parameters.height,
                parameters.width, 
                3), dtype = "uint8")

def image_callback(self, msg):
    image = msg
    new_image = True
    rospy.loginfo("[IMG] New Image Received")
    
    
setup_camera()
[INFO] [1638406965.042962]: Camera Online
[DEBUG] [1638406965.157243]: connecting to a2dam-parmenides 39269
---------------------------------------------------------------------------
NameError                                 Traceback (most recent call last)
/tmp/ipykernel_17084/1610968738.py in <module>
     21 
     22 
---> 23 setup_camera()

/tmp/ipykernel_17084/1610968738.py in setup_camera()
     11 
     12     canvas = np.zeros((
---> 13                 parameters.height,
     14                 parameters.width,
     15                 3), dtype = "uint8")

NameError: name 'parameters' is not defined
[ERROR] [1638406965.392780]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406965.728967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406965.960340]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406966.267073]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406966.529887]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406966.974556]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406967.335674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406967.599110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406967.837669]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406968.261480]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406968.601674]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406969.020097]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406969.195047]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406969.438715]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406969.638567]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406969.939890]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406970.166264]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406970.438156]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406970.675138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406970.899286]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406971.224946]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406971.393549]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406971.654413]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406971.812865]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406972.093329]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406972.267785]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406972.463981]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406972.631265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638406972.825138]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406973.026750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406973.349769]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406973.778045]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406974.228746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406974.714612]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406974.901325]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406975.269022]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406975.559731]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406976.050912]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406976.481176]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406977.027386]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406977.291175]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406977.884934]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406978.164827]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406978.402479]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406978.585964]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406978.850570]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406979.127321]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406979.427256]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406979.761900]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406980.149782]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406980.485686]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406980.909615]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406981.276114]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406981.700225]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406982.066478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638406982.278904]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406982.621300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406982.904834]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406983.214035]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406983.527565]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406983.699901]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406983.910174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406984.138839]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406984.451756]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406984.904435]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406985.168380]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406985.479521]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406985.912478]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406986.157254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406986.353877]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406986.694307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406986.978201]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406987.296881]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406987.589634]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406987.880404]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406988.135970]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406988.523697]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406988.887854]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406989.206783]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406989.526307]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406989.807276]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406990.011265]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638406990.308026]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406990.597465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406990.834745]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406991.336006]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406991.816378]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406992.157942]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406992.726995]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406993.170162]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406993.425723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406993.907789]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406994.217309]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406994.554848]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406994.806753]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406995.098638]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406995.535461]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406995.837712]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406996.102582]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406996.378864]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406996.694271]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406996.937155]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406997.294184]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406997.688344]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406998.007174]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406998.307464]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406998.591055]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406998.904897]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406999.293520]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638406999.603604]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638406999.907768]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407000.253734]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407000.592300]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407001.056607]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407001.369967]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407001.615395]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407001.937110]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407002.297973]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407002.666613]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407002.841267]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407003.222213]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407003.474510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407003.671737]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407004.018910]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407004.247456]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407004.504784]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407004.950812]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407005.206746]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407005.540673]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407005.768707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407006.036689]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407006.417299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407006.778983]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407007.118181]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407007.507626]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407007.713759]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407008.135989]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407008.444407]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407008.718560]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407009.082347]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407009.355532]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407009.690693]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407010.160530]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407010.457005]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407010.776240]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407011.188150]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407011.548948]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407011.808364]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407012.102016]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407012.439707]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407012.853009]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407013.170292]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407013.505218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407013.773304]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407014.100469]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407014.435023]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407014.731960]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407015.146254]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407015.504039]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407015.812637]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407016.043807]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407016.357483]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407016.668410]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407016.952724]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407017.200263]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407017.534394]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407017.818740]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407018.152499]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407018.444129]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407018.697232]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407019.091916]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407019.348670]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407019.625251]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407019.975698]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407020.279465]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407020.606117]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407020.914460]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407021.210646]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407021.417657]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407021.705444]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407021.967750]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407022.214761]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407022.581333]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407022.861164]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407023.146518]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407023.401959]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407023.645065]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407023.953492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407024.288157]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407024.666723]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
[ERROR] [1638407024.941680]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407025.169926]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407025.434492]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407025.723089]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407025.923992]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407026.288617]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407026.542906]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407026.895149]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407027.217618]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407027.500504]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407027.754121]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407027.998166]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407028.371608]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407028.544178]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407028.841299]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407029.034218]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407029.316610]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407029.518661]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407029.835510]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407030.012811]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407030.296284]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407030.522863]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'

[ERROR] [1638407030.792238]: bad callback: <function image_callback at 0xffff88e929d0>
Traceback (most recent call last):
  File "/opt/ros/noetic/lib/python3/dist-packages/rospy/topics.py", line 750, in _invoke_callback
    cb(msg)
TypeError: image_callback() missing 1 required positional argument: 'msg'
def setup_ros(self):
    
    self.bridge = CvBridge()
    self.setup_camera()
    self.setup_pose_detector()
    self.setup_scene_segmentation()
    self.setup_vr_publisher()
def setup_vr_publisher(self):
    self.pub = rospy.Publisher(
        'SEG/debugger',
        Image,
        queue_size=1
        )
class SegmentationDebugger(object):
    
    def __init__(self):
        #self.name = NameManager()
        #self.dynamic_updates()
        #self.pose_estimations = InferenceResults()
        #self.setup_parameters()
        self.setup_ros()
        #self.setup_scene_segmentation()
        self.loop()



        

        

            


    def setup_scene_segmentation(self):
        self.mask = InferenceResults()
        self.new_mask = True
        rospy.Subscriber(
            'model_output/scene_segmentation/segmentation_mask',
            InferenceResults,
            self.scene_segmentation_callback,
            queue_size=1
            )
        self.colormap = np.array([[68, 1, 84], [48, 103, 141], [53, 183, 120], [199, 216, 52]])
        rospy.loginfo("Scene Segmentation subscription active")

    def scene_segmentation_callback(self, msg):
        self.mask = msg
        self.new_mask = True
        print (self.mask)
        rospy.loginfo("[SEG] New Masks Received")
   


    def decode_inference_results(self, results, model: str = "SEG"):
        try:
            structure = results.structure
            print(name, structure)
        except:
            rospy.logerr(
            f"[{name}] Cannot convert {type(self.results.structure)} to structure"
            )
            return
        print ("------------------------------------------")
        try:
            inferences = np.asarray(results.inferences)
            print(inferences)
            rospy.loginfo(f"[{name}] Transformed shape: {inferences.shape}")
        except:
            rospy.logerr(f'[{name}] Cannot convert to numpy array')
            return
            
        try:
            inference_array = inferences.reshape(structure)
            print(inference_array)
        except:
            rospy.logerr(f"[{name}] Cannot wrangle data blob")
            return

        return inference_array
            
    def update_segmentation_graph(self):

        inference_array = self.decode_inference_results(
                self.mask, 
                model="SEG"
                )
                
        mask = segmentation_map_to_image(inference_array, self.colormap)

        self.segmentation_graph = cv2.resize(
            inference_array, 
            (self.image.width, self.image.height))
            
        return


    def combine_segmentation_image(self):

        alpha = 0.3
        self.timer.lap("Image Overlay")

        self.canvas = cv2.addWeighted(
            self.segmentation_graph, 
            alpha, #self.parameters.alpha, 
            self.img, 
            1 - alpha, 
            0)

        return 


    def action_loop(self):

        if self.new_mask:
            self.update_segmentation_graph()
            self.new_mask = False
        
        image_output = True
        
        if image_output: #self.parameters.image_output:
            if self.new_image:
                try:
                    # Convert the camera image to ROS
                    self.img = self.bridge.imgmsg_to_cv2(
                        self.image, 
                        desired_encoding="bgr8"
                        )
                        
                    self.new_graph = False

                except CvBridgeError as e:
                    # if this fails then give us the last good image.
                    rospy.logerr("[IMG] Error converting ROS msg to image.")
                    print(e)
            
            temp = False
            if temp: #self.parameters.segmentationmodel:
                try:
                    # We can now combine them on the 'self.canvas' layer.
                    self.combine_segmentation_image()
                except:
                    rospy.logerr("[SEG] Error proccessing scene")
        else:
            if self.parameters.segmentation_model:
                self.canvas = self.segmentation_graph
            else:
                self.canvas = np.zeros((
                    self.height, 
                    self.width, 
                    3
                    ), dtype = "uint8"
                    )

        try:
            image_ros = self.bridge.cv2_to_imgmsg(self.canvas, 'bgr8')
            return image_ros
            
        except (CvBridgeError, TypeError, UnboundLocalError) as e:
            rospy.logerr("[IMG]Error converting to ROS msg")
            print (e)
            return self.image

    def loop(self):

        rate = rospy.Rate(15)
        while not rospy.is_shutdown():  
            ros_image = self.action_loop()
            self.pub.publish(ros_image)
            rate.sleep()

if __name__ == '__main__':
    SegmentationDebugger()